#include <vector>
#include <string>
#include <boost/shared_ptr.hpp>
#include <moveit_msgs/RobotTrajectory.h>
#include <geometry_msgs/PointStamped.h>
Go to the source code of this file.
Classes | |
class | moveit_sensor_manager::MoveItSensorManager |
struct | moveit_sensor_manager::SensorInfo |
Define the frame of reference and the frustum of a sensor (usually this is a visual sensor) More... | |
Namespaces | |
namespace | moveit_sensor_manager |
Namespace for the base class of a MoveIt sensor manager. | |
Typedefs | |
typedef boost::shared_ptr < const MoveItSensorManager > | moveit_sensor_manager::MoveItSensorManagerConstPtr |
typedef boost::shared_ptr < MoveItSensorManager > | moveit_sensor_manager::MoveItSensorManagerPtr |