#include <moveit/robot_state/robot_state.h>
#include <moveit_msgs/RobotTrajectory.h>
#include <moveit_msgs/RobotState.h>
#include <deque>
Go to the source code of this file.
Classes | |
class | robot_trajectory::RobotTrajectory |
Maintain a sequence of waypoints and the time durations between these waypoints. More... | |
Namespaces | |
namespace | robot_trajectory |
Typedefs | |
typedef boost::shared_ptr < const RobotTrajectory > | robot_trajectory::RobotTrajectoryConstPtr |
typedef boost::shared_ptr < RobotTrajectory > | robot_trajectory::RobotTrajectoryPtr |