#include <moveit/macros/class_forward.h>
#include <moveit/robot_model/robot_model.h>
#include <moveit/planning_scene_monitor/current_state_monitor.h>
#include <moveit_msgs/RobotTrajectory.h>
#include <sensor_msgs/JointState.h>
#include <std_msgs/String.h>
#include <ros/ros.h>
#include <moveit/controller_manager/controller_manager.h>
#include <boost/thread.hpp>
#include <pluginlib/class_loader.hpp>
#include <memory>
Go to the source code of this file.
Classes | |
struct | trajectory_execution_manager::TrajectoryExecutionManager::ControllerInformation |
struct | trajectory_execution_manager::TrajectoryExecutionManager::TrajectoryExecutionContext |
Data structure that represents information necessary to execute a trajectory. More... | |
class | trajectory_execution_manager::TrajectoryExecutionManager |
Namespaces | |
trajectory_execution_manager | |
Functions | |
trajectory_execution_manager::MOVEIT_CLASS_FORWARD (TrajectoryExecutionManager) | |