#include <moveit/robot_state/robot_state.h>
#include <moveit_msgs/RobotTrajectory.h>
#include <moveit_msgs/RobotState.h>
#include <moveit_msgs/PlannerInterfaceDescription.h>
#include <moveit_msgs/Constraints.h>
#include <moveit_msgs/Grasp.h>
#include <moveit_msgs/PlaceLocation.h>
#include <geometry_msgs/PoseStamped.h>
#include <boost/shared_ptr.hpp>
#include <tf/tf.h>
Go to the source code of this file.
Classes | |
class | moveit::planning_interface::MoveGroup |
Client class for the MoveGroup action. This class includes many default settings to make things easy to use. More... | |
class | moveit::planning_interface::MoveItErrorCode |
struct | moveit::planning_interface::MoveGroup::Options |
Specification of options to use when constructing the MoveGroup client class. More... | |
struct | moveit::planning_interface::MoveGroup::Plan |
The representation of a motion plan (as ROS messasges) More... | |
Namespaces | |
namespace | moveit |
namespace | moveit::planning_interface |
Simple interface to MoveIt! components. |