Skip to content

Commit a99279b

Browse files
committed
updating tutorials for jazzy/main
Signed-off-by: Steve Macenski <[email protected]>
1 parent 8d80918 commit a99279b

File tree

4 files changed

+9
-6
lines changed

4 files changed

+9
-6
lines changed

nav2_pure_pursuit_controller/include/nav2_pure_pursuit_controller/pure_pursuit_controller.hpp

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -28,8 +28,8 @@ class PurePursuitController : public nav2_core::Controller
2828

2929
void configure(
3030
const rclcpp_lifecycle::LifecycleNode::WeakPtr & parent,
31-
std::string name, const std::shared_ptr<tf2_ros::Buffer> & tf,
32-
const std::shared_ptr<nav2_costmap_2d::Costmap2DROS> & costmap_ros) override;
31+
std::string name, const std::shared_ptr<tf2_ros::Buffer> tf,
32+
const std::shared_ptr<nav2_costmap_2d::Costmap2DROS> costmap_ros) override;
3333

3434

3535
void cleanup() override;
@@ -39,7 +39,7 @@ class PurePursuitController : public nav2_core::Controller
3939

4040
geometry_msgs::msg::TwistStamped computeVelocityCommands(
4141
const geometry_msgs::msg::PoseStamped & pose,
42-
const geometry_msgs::msg::Twist & velocity
42+
const geometry_msgs::msg::Twist & velocity,
4343
nav2_core::GoalChecker * goal_checker) override;
4444

4545
void setPlan(const nav_msgs::msg::Path & path) override;

nav2_pure_pursuit_controller/src/pure_pursuit_controller.cpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -10,7 +10,8 @@
1010
#include <string>
1111
#include <memory>
1212

13-
#include "nav2_core/exceptions.hpp"
13+
#include "nav2_core/controller_exceptions.hpp"
14+
#include "nav2_core/planner_exceptions.hpp"
1415
#include "nav2_util/node_utils.hpp"
1516
#include "nav2_pure_pursuit_controller/pure_pursuit_controller.hpp"
1617
#include "nav2_util/geometry_utils.hpp"

nav2_straightline_planner/include/nav2_straightline_planner/straight_line_planner.hpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -81,7 +81,8 @@ class StraightLine : public nav2_core::GlobalPlanner
8181
// This method creates path for given start and goal pose.
8282
nav_msgs::msg::Path createPlan(
8383
const geometry_msgs::msg::PoseStamped & start,
84-
const geometry_msgs::msg::PoseStamped & goal) override;
84+
const geometry_msgs::msg::PoseStamped & goal,
85+
std::function<bool()> cancel_checker) override;
8586

8687
private:
8788
// TF buffer

nav2_straightline_planner/src/straight_line_planner.cpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -89,7 +89,8 @@ void StraightLine::deactivate()
8989

9090
nav_msgs::msg::Path StraightLine::createPlan(
9191
const geometry_msgs::msg::PoseStamped & start,
92-
const geometry_msgs::msg::PoseStamped & goal)
92+
const geometry_msgs::msg::PoseStamped & goal,
93+
std::function<bool()> /*cancel_checker*/)
9394
{
9495
nav_msgs::msg::Path global_path;
9596

0 commit comments

Comments
 (0)