29 #ifndef SWRI_ROUTE_UTIL_PATH_UTIL_H_ 30 #define SWRI_ROUTE_UTIL_PATH_UTIL_H_ 32 #include <marti_nav_msgs/Path.h> 42 void transform(marti_nav_msgs::Path &path,
44 const std::string &target_frame);
62 const marti_nav_msgs::Path& path,
63 const double x,
const double y,
65 double& nearest_separation);
72 const bool allow_extrapolation =
false);
80 #endif // SWRI_ROUTE_UTIL_UTIL_H_
bool findLocalNearestDistanceForward(const marti_nav_msgs::Path &path, const double x, const double y, PathPosition &nearest_position, double &nearest_separation)
void getPathPose(const marti_nav_msgs::Path &path, const PathPosition position, tf::Transform &tf, const bool allow_extrapolation=false)
void getPathPosition(const marti_nav_msgs::Path &path, const PathPosition position, tf::Vector3 &tf)
void transform(marti_nav_msgs::Path &path, const swri_transform_util::Transform &transform, const std::string &target_frame)
void fillOrientations(marti_nav_msgs::Path &path)