#include <vector>
#include <string>
#include <boost/shared_ptr.hpp>
#include <moveit_msgs/RobotTrajectory.h>
Go to the source code of this file.
Classes | |
struct | moveit_controller_manager::MoveItControllerManager::ControllerState |
Each controller known to MoveIt has a state. This structure describes that controller's state. More... | |
struct | moveit_controller_manager::ExecutionStatus |
The reported execution status. More... | |
class | moveit_controller_manager::MoveItControllerHandle |
MoveIt sends commands to a controller via a handle that satisfies this interface. More... | |
class | moveit_controller_manager::MoveItControllerManager |
MoveIt! does not enforce how controllers are implemented. To make your controllers usable by MoveIt, this interface needs to be implemented. The main purpose of this interface is to expose the set of known controllers and potentially to allow activating and deactivating them, if multiple controllers are available. More... | |
Namespaces | |
namespace | moveit_controller_manager |
Namespace for the base class of a MoveIt controller manager. | |
Typedefs | |
typedef boost::shared_ptr < const MoveItControllerHandle > | moveit_controller_manager::MoveItControllerHandleConstPtr |
typedef boost::shared_ptr < MoveItControllerHandle > | moveit_controller_manager::MoveItControllerHandlePtr |
typedef boost::shared_ptr < const MoveItControllerManager > | moveit_controller_manager::MoveItControllerManagerConstPtr |
typedef boost::shared_ptr < MoveItControllerManager > | moveit_controller_manager::MoveItControllerManagerPtr |