34 #ifndef DWB_CRITICS_PATH_ALIGN_H_ 35 #define DWB_CRITICS_PATH_ALIGN_H_ 61 bool prepare(
const geometry_msgs::Pose2D& pose,
const nav_2d_msgs::Twist2D& vel,
62 const geometry_msgs::Pose2D& goal,
const nav_2d_msgs::Path2D& global_plan)
override;
64 double scorePose(
const geometry_msgs::Pose2D& pose)
override;
71 #endif // DWB_CRITICS_PATH_ALIGN_H_ 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 from the global path the front of the robot ends up...
Scores trajectories based on how far from the global path they end up.
double forward_point_distance_
double getScale() const override
double scorePose(const geometry_msgs::Pose2D &pose) override
Retrieve the score for a single pose.