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;
    60 #endif  // DWB_CRITICS_GOAL_DIST_H_ 
TFSIMD_FORCE_INLINE const tfScalar & y() const 
bool prepare(const geometry_msgs::Pose2D &pose, const nav_2d_msgs::Twist2D &vel, const geometry_msgs::Pose2D &goal, const nav_2d_msgs::Path2D &global_plan) override
Scores trajectories based on how far along the global path they end up. 
breadth-first scoring of all the cells in the costmap 
TFSIMD_FORCE_INLINE const tfScalar & x() const 
bool getLastPoseOnCostmap(const nav_2d_msgs::Path2D &global_plan, unsigned int &x, unsigned int &y)