35 #ifndef DWB_PLUGINS_STOPPED_GOAL_CHECKER_H 36 #define DWB_PLUGINS_STOPPED_GOAL_CHECKER_H 54 bool isGoalReached(
const geometry_msgs::Pose2D& query_pose,
const geometry_msgs::Pose2D& goal_pose,
55 const nav_2d_msgs::Twist2D& velocity)
override;
62 #endif // DWB_PLUGINS_STOPPED_GOAL_CHECKER_H
Goal Checker plugin that checks the position difference and velocity.
double trans_stopped_velocity_
double rot_stopped_velocity_
void initialize(const ros::NodeHandle &nh) override
Goal Checker plugin that only checks the position difference.
bool isGoalReached(const geometry_msgs::Pose2D &query_pose, const geometry_msgs::Pose2D &goal_pose, const nav_2d_msgs::Twist2D &velocity) override