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::function< void(const robot_state::RobotStateConstPtr &state, const ros::Time &stamp)> | TrajectoryStateAddedCallback |
Functions | |
MOVEIT_CLASS_FORWARD (TrajectoryMonitor) | |
MOVEIT_CLASS_FORWARD (PlanningSceneMonitor) | |
MOVEIT_CLASS_FORWARD (CurrentStateMonitor) | |
Variables | |
static const std::string | LOGNAME = "planning_scene_monitor" |
typedef boost::function<void(const sensor_msgs::JointStateConstPtr& joint_state)> planning_scene_monitor::JointStateUpdateCallback |
Definition at line 50 of file current_state_monitor.h.
typedef boost::function<void(const robot_state::RobotStateConstPtr& state, const ros::Time& stamp)> planning_scene_monitor::TrajectoryStateAddedCallback |
Definition at line 48 of file trajectory_monitor.h.
planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | TrajectoryMonitor | ) |
planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | PlanningSceneMonitor | ) |
planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | CurrentStateMonitor | ) |
const std::string planning_scene_monitor::LOGNAME = "planning_scene_monitor" [static] |
Definition at line 51 of file planning_scene_monitor.cpp.