Go to the source code of this file.
|
void | swri_route_util::fillOrientations (marti_nav_msgs::Path &path) |
|
bool | swri_route_util::findLocalNearestDistanceForward (const marti_nav_msgs::Path &path, const double x, const double y, PathPosition &nearest_position, double &nearest_separation) |
|
void | swri_route_util::getPathPose (const marti_nav_msgs::Path &path, const PathPosition position, tf::Transform &tf, const bool allow_extrapolation=false) |
|
void | swri_route_util::getPathPosition (const marti_nav_msgs::Path &path, const PathPosition position, tf::Vector3 &tf) |
|
static double | swri_route_util::interpolateAngle (double from, double to, double t) |
|
static void | swri_route_util::normalizePathPosition (const marti_nav_msgs::Path &path, PathPosition &position) |
|
void | swri_route_util::transform (marti_nav_msgs::Path &path, const swri_transform_util::Transform &transform, const std::string &target_frame) |
|