Classes | |
class | CurrentStateMonitor |
Monitors the joint_states topic and tf to maintain the current state of the robot. More... | |
class | LockedPlanningSceneRO |
This is a convenience class for obtaining access to an instance of a locked PlanningScene. More... | |
class | LockedPlanningSceneRW |
This is a convenience class for obtaining access to an instance of a locked PlanningScene. More... | |
class | PlanningSceneMonitor |
PlanningSceneMonitor Subscribes to the topic planning_scene. More... | |
class | TrajectoryMonitor |
Monitors the joint_states topic and tf to record the trajectory of the robot. More... | |
Typedefs | |
typedef boost::function< void(const sensor_msgs::JointStateConstPtr &joint_state)> | JointStateUpdateCallback |
typedef boost::shared_ptr < const PlanningSceneMonitor > | PlanningSceneMonitorConstPtr |
typedef boost::shared_ptr < PlanningSceneMonitor > | PlanningSceneMonitorPtr |
typedef boost::shared_ptr < const TrajectoryMonitor > | TrajectoryMonitorConstPtr |
typedef boost::shared_ptr < TrajectoryMonitor > | TrajectoryMonitorPtr |
typedef boost::function< void(const robot_state::RobotStateConstPtr &state, const ros::Time &stamp)> | TrajectoryStateAddedCallback |
Functions | |
MOVEIT_CLASS_FORWARD (CurrentStateMonitor) |
typedef boost::function<void(const sensor_msgs::JointStateConstPtr &joint_state)> planning_scene_monitor::JointStateUpdateCallback |
Definition at line 51 of file current_state_monitor.h.
typedef boost::shared_ptr<const PlanningSceneMonitor> planning_scene_monitor::PlanningSceneMonitorConstPtr |
Definition at line 515 of file planning_scene_monitor.h.
typedef boost::shared_ptr<PlanningSceneMonitor> planning_scene_monitor::PlanningSceneMonitorPtr |
Definition at line 514 of file planning_scene_monitor.h.
typedef boost::shared_ptr<const TrajectoryMonitor> planning_scene_monitor::TrajectoryMonitorConstPtr |
Definition at line 108 of file trajectory_monitor.h.
typedef boost::shared_ptr<TrajectoryMonitor> planning_scene_monitor::TrajectoryMonitorPtr |
Definition at line 107 of file trajectory_monitor.h.
typedef boost::function<void(const robot_state::RobotStateConstPtr &state, const ros::Time &stamp)> planning_scene_monitor::TrajectoryStateAddedCallback |
Definition at line 47 of file trajectory_monitor.h.
planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | CurrentStateMonitor | ) |