#include <moveit/common_planning_interface_objects/common_objects.h>
#include <moveit/robot_model_loader/robot_model_loader.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
Namespaces | |
moveit | |
moveit::planning_interface | |
Simple interface to MoveIt! components. | |
Functions | |
robot_model::RobotModelConstPtr | moveit::planning_interface::getSharedRobotModel (const std::string &robot_description) |
planning_scene_monitor::CurrentStateMonitorPtr | moveit::planning_interface::getSharedStateMonitor (const robot_model::RobotModelConstPtr &kmodel, const boost::shared_ptr< tf::Transformer > &tf) |
getSharedStateMonitor is a simpler version of getSharedStateMonitor(const robot_model::RobotModelConstPtr &kmodel, const boost::shared_ptr<tf::Transformer> &tf, 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 robot_model::RobotModelConstPtr &kmodel, const boost::shared_ptr< tf::Transformer > &tf, ros::NodeHandle nh) |
getSharedStateMonitor More... | |
boost::shared_ptr< tf::Transformer > | moveit::planning_interface::getSharedTF () |