#include <moveit/macros/class_forward.h>
#include <moveit/macros/deprecation.h>
#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 <moveit_msgs/MotionPlanRequest.h>
#include <moveit_msgs/MoveGroupAction.h>
#include <geometry_msgs/PoseStamped.h>
#include <actionlib/client/simple_action_client.h>
#include <boost/shared_ptr.hpp>
#include <tf/tf.h>
Go to the source code of this file.
Classes | |
class | moveit::planning_interface::MoveGroupInterface |
Client class to conveniently use the ROS interfaces provided by the move_group node. More... | |
class | moveit::planning_interface::MoveItErrorCode |
struct | moveit::planning_interface::MoveGroupInterface::Options |
Specification of options to use when constructing the MoveGroupInterface class. More... | |
struct | moveit::planning_interface::MoveGroupInterface::Plan |
The representation of a motion plan (as ROS messasges) More... | |
Namespaces | |
moveit | |
moveit::planning_interface | |
Simple interface to MoveIt! components. | |
Functions | |
moveit::planning_interface::MOVEIT_CLASS_FORWARD (MoveGroupInterface) | |