#include <ros/ros.h>#include <angles/angles.h>#include <tf2/utils.h>#include "graceful_controller_ros/orientation_tools.hpp"
Go to the source code of this file.
Namespaces | |
| graceful_controller | |
Functions | |
| std::vector< geometry_msgs::PoseStamped > | graceful_controller::addOrientations (const std::vector< geometry_msgs::PoseStamped > &path) |
| Add orientation to each pose in a path. More... | |
| std::vector< geometry_msgs::PoseStamped > | graceful_controller::applyOrientationFilter (const std::vector< geometry_msgs::PoseStamped > &path, double yaw_tolerance, double gap_tolerance) |
| Filter a path for orientation noise. More... | |
| double | graceful_controller::getRelativeYaw (const geometry_msgs::PoseStamped &from, const geometry_msgs::PoseStamped &to) |
| void | graceful_controller::setYaw (geometry_msgs::PoseStamped &pose, double yaw) |