#include <ros/ros.h>#include <control_msgs/FollowJointTrajectoryAction.h>#include <sensor_msgs/JointState.h>#include <actionlib/server/simple_action_server.h>#include <brics_actuator/JointPositions.h>#include <brics_actuator/JointVelocities.h>

Go to the source code of this file.
Classes | |
| class | JointTrajectoryAction |
Namespaces | |
| namespace | KDL |
Typedefs | |
| typedef actionlib::SimpleActionServer < control_msgs::FollowJointTrajectoryAction > | Server |
| typedef actionlib::SimpleActionServer<control_msgs::FollowJointTrajectoryAction> Server |
Definition at line 56 of file joint_trajectory_action.h.