34 #ifndef DWB_CRITICS_GOAL_ALIGN_H_ 35 #define DWB_CRITICS_GOAL_ALIGN_H_ 57 bool prepare(
const geometry_msgs::Pose2D& pose,
const nav_2d_msgs::Twist2D& vel,
58 const geometry_msgs::Pose2D& goal,
const nav_2d_msgs::Path2D& global_plan)
override;
59 double scorePose(
const geometry_msgs::Pose2D& pose)
override;
65 #endif // DWB_CRITICS_GOAL_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 along the global path they end up.
double scorePose(const geometry_msgs::Pose2D &pose) override
Retrieve the score for a single pose.
Scores trajectories based on whether the robot ends up pointing toward the eventual goal...
double forward_point_distance_