35 #ifndef DWB_LOCAL_PLANNER_TRAJECTORY_UTILS_H 36 #define DWB_LOCAL_PLANNER_TRAJECTORY_UTILS_H 38 #include <dwb_msgs/Trajectory2D.h> 52 const geometry_msgs::Pose2D&
getClosestPose(
const dwb_msgs::Trajectory2D& trajectory,
const double time_offset);
61 geometry_msgs::Pose2D
projectPose(
const dwb_msgs::Trajectory2D& trajectory,
const double time_offset);
65 #endif // DWB_LOCAL_PLANNER_TRAJECTORY_UTILS_H const geometry_msgs::Pose2D & 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.
geometry_msgs::Pose2D 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...