Scores trajectories based on how far from the global path they end up. More...
#include <path_dist.h>
Public Member Functions | |
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 they end up.
Definition at line 45 of file path_dist.h.
bool dwb_critics::PathDistCritic::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, virtual] |
Reimplemented from dwb_local_planner::TrajectoryCritic.
Reimplemented in dwb_critics::PathAlignCritic.
Definition at line 42 of file path_dist.cpp.