

Go to the source code of this file.
Namespaces | |
| moveit | |
| moveit::planning_interface | |
| Simple interface to MoveIt components. | |
Functions | |
| moveit::core::RobotModelConstPtr | moveit::planning_interface::getSharedRobotModel (const std::string &robot_description) |
| planning_scene_monitor::CurrentStateMonitorPtr | moveit::planning_interface::getSharedStateMonitor (const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer) |
| getSharedStateMonitor is a simpler version of getSharedStateMonitor(const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr<tf2_ros::Buffer>& tf_buffer, ros::NodeHandle nh = ros::NodeHandle() ). It calls this function using the default constructed ros::NodeHandle More... | |
| planning_scene_monitor::CurrentStateMonitorPtr | moveit::planning_interface::getSharedStateMonitor (const moveit::core::RobotModelConstPtr &robot_model, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer, const ros::NodeHandle &nh) |
| getSharedStateMonitor More... | |
| std::shared_ptr< tf2_ros::Buffer > | moveit::planning_interface::getSharedTF () |