34 #ifndef MIR_DWB_CRITICS_PATH_ANGLE_H_ 35 #define MIR_DWB_CRITICS_PATH_ANGLE_H_ 60 virtual bool prepare(
const geometry_msgs::Pose2D& pose,
const nav_2d_msgs::Twist2D& vel,
61 const geometry_msgs::Pose2D& goal,
62 const nav_2d_msgs::Path2D& global_plan)
override;
64 virtual double scoreTrajectory(
const dwb_msgs::Trajectory2D& traj)
override;
71 #endif // MIR_DWB_CRITICS_PATH_ANGLE_H_
Scores trajectories based on the difference between the path's current angle and the trajectory's ang...
virtual double scoreTrajectory(const dwb_msgs::Trajectory2D &traj) override
virtual 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