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_