35 #ifndef DWB_LOCAL_PLANNER_GOAL_CHECKER_H 36 #define DWB_LOCAL_PLANNER_GOAL_CHECKER_H 39 #include <geometry_msgs/Pose2D.h> 40 #include <nav_2d_msgs/Twist2D.h> 57 using Ptr = std::shared_ptr<dwb_local_planner::GoalChecker>;
79 virtual bool isGoalReached(
const geometry_msgs::Pose2D& query_pose,
const geometry_msgs::Pose2D& goal_pose,
80 const nav_2d_msgs::Twist2D& velocity) = 0;
85 #endif // DWB_LOCAL_PLANNER_GOAL_CHECKER_H
Function-object for checking whether a goal has been reached.
std::shared_ptr< dwb_local_planner::GoalChecker > Ptr
virtual void reset()
Reset the state of the goal checker (if any)
virtual bool isGoalReached(const geometry_msgs::Pose2D &query_pose, const geometry_msgs::Pose2D &goal_pose, const nav_2d_msgs::Twist2D &velocity)=0
Check whether the goal should be considered reached.
virtual void initialize(const ros::NodeHandle &nh)=0
Initialize any parameters from the NodeHandle.