#include <mutex>
#include <nav_core/base_local_planner.h>
#include <nav_msgs/Path.h>
#include <base_local_planner/local_planner_util.h>
#include <base_local_planner/odometry_helper_ros.h>
#include <graceful_controller/graceful_controller.hpp>
#include <graceful_controller_ros/orientation_tools.hpp>
#include <std_msgs/Float32.h>
#include <tf2/utils.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <dynamic_reconfigure/server.h>
#include <graceful_controller_ros/GracefulControllerConfig.h>
#include "graceful_controller_ros/visualization.hpp"
Go to the source code of this file.
Classes | |
class | graceful_controller::GracefulControllerROS |
Namespaces | |
graceful_controller | |
Functions | |
void | graceful_controller::computeDistanceAlongPath (const std::vector< geometry_msgs::PoseStamped > &poses, std::vector< double > &distances) |
Compute distance of poses along a path. Assumes poses are in robot-centric frame. More... | |