Classes | |
class | CurrentStateMonitor |
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 |
Typedefs | |
using | JointStateUpdateCallback = boost::function< void(const sensor_msgs::JointStateConstPtr &)> |
using | TrajectoryStateAddedCallback = boost::function< void(const moveit::core::RobotStateConstPtr &, const ros::Time &)> |
Functions | |
MOVEIT_CLASS_FORWARD (CurrentStateMonitor) | |
MOVEIT_CLASS_FORWARD (PlanningSceneMonitor) | |
MOVEIT_CLASS_FORWARD (TrajectoryMonitor) | |
Variables | |
static const std::string | LOGNAME = "planning_scene_monitor" |
using planning_scene_monitor::JointStateUpdateCallback = typedef boost::function<void(const sensor_msgs::JointStateConstPtr&)> |
Definition at line 81 of file current_state_monitor.h.
using planning_scene_monitor::TrajectoryStateAddedCallback = typedef boost::function<void(const moveit::core::RobotStateConstPtr&, const ros::Time&)> |
Definition at line 79 of file trajectory_monitor.h.
planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | CurrentStateMonitor | ) |
planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | PlanningSceneMonitor | ) |
planning_scene_monitor::MOVEIT_CLASS_FORWARD | ( | TrajectoryMonitor | ) |
|
static |
Definition at line 91 of file planning_scene_monitor.cpp.