34 #ifndef DWB_CRITICS_GOAL_DIST_H_
35 #define DWB_CRITICS_GOAL_DIST_H_
53 bool prepare(
const geometry_msgs::Pose2D& pose,
const nav_2d_msgs::Twist2D& vel,
54 const geometry_msgs::Pose2D& goal,
const nav_2d_msgs::Path2D& global_plan)
override;
56 bool getLastPoseOnCostmap(
const nav_2d_msgs::Path2D& global_plan,
unsigned int& x,
unsigned int& y);
60 #endif // DWB_CRITICS_GOAL_DIST_H_