#include <dwb_msgs/Trajectory2D.h>
Go to the source code of this file.
|
const geometry_msgs::Pose2D & | dwb_local_planner::getClosestPose (const dwb_msgs::Trajectory2D &trajectory, const double time_offset) |
| Helper function to find a pose in the trajectory with a particular time time_offset. More...
|
|
geometry_msgs::Pose2D | dwb_local_planner::projectPose (const dwb_msgs::Trajectory2D &trajectory, const double time_offset) |
| Helper function to create a pose with an exact time_offset by linearly interpolating between existing poses. More...
|
|