#include <ros/ros.h>#include <sensor_msgs/JointState.h>#include <map>#include <actionlib/client/simple_action_client.h>#include <actionlib/client/terminal_state.h>#include <path_navigation_msgs/TransformPathExecutionAction.h>#include <path_navigation_msgs/TransformPathExecutionActionResult.h>#include <path_navigation_msgs/PathExecutionAction.h>#include <path_navigation_msgs/PathExecutionActionResult.h>#include <trajectory_msgs/JointTrajectory.h>#include <control_msgs/FollowJointTrajectoryAction.h>#include <control_msgs/FollowJointTrajectoryFeedback.h>#include <moveit_msgs/RobotTrajectory.h>

Go to the source code of this file.
Classes | |
| class | moveit_controller_multidof::RobotTrajectoryExecutor |
Namespaces | |
| namespace | moveit_controller_multidof |
Defines | |
| #define | DEFAULT_TRAJECTORY_ACTION_TOPIC "/joint_trajectory_action" |
| #define DEFAULT_TRAJECTORY_ACTION_TOPIC "/joint_trajectory_action" |
Definition at line 19 of file RobotTrajectoryExecutor.h.