Public Member Functions | Private Member Functions | Private Attributes | List of all members
moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl Class Reference

Public Member Functions

void addCollisionObjects (const std::vector< moveit_msgs::CollisionObject > &collision_objects, const std::vector< moveit_msgs::ObjectColor > &object_colors) const
 
bool applyPlanningScene (const moveit_msgs::PlanningScene &planning_scene)
 
bool clear ()
 
std::map< std::string, moveit_msgs::AttachedCollisionObject > getAttachedObjects (const std::vector< std::string > &object_ids)
 
std::vector< std::string > getKnownObjectNames (bool with_type)
 
std::vector< std::string > getKnownObjectNamesInROI (double minx, double miny, double minz, double maxx, double maxy, double maxz, bool with_type, std::vector< std::string > &types)
 
std::map< std::string, geometry_msgs::PosegetObjectPoses (const std::vector< std::string > &object_ids)
 
std::map< std::string, moveit_msgs::CollisionObject > getObjects (const std::vector< std::string > &object_ids)
 
moveit_msgs::PlanningScene getPlanningSceneMsg (uint32_t components)
 
 PlanningSceneInterfaceImpl (const std::string &ns="", bool wait=true)
 
void removeCollisionObjects (const std::vector< std::string > &object_ids) const
 

Private Member Functions

void waitForService (ros::ServiceClient &srv)
 

Private Attributes

ros::ServiceClient apply_planning_scene_service_
 
ros::NodeHandle node_handle_
 
ros::Publisher planning_scene_diff_publisher_
 
ros::ServiceClient planning_scene_service_
 
moveit::core::RobotModelConstPtr robot_model_
 

Detailed Description

Definition at line 115 of file planning_scene_interface/src/planning_scene_interface.cpp.

Constructor & Destructor Documentation

◆ PlanningSceneInterfaceImpl()

moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::PlanningSceneInterfaceImpl ( const std::string &  ns = "",
bool  wait = true 
)
inlineexplicit

Member Function Documentation

◆ addCollisionObjects()

void moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::addCollisionObjects ( const std::vector< moveit_msgs::CollisionObject > &  collision_objects,
const std::vector< moveit_msgs::ObjectColor > &  object_colors 
) const
inline

◆ applyPlanningScene()

bool moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::applyPlanningScene ( const moveit_msgs::PlanningScene &  planning_scene)
inline

◆ clear()

bool moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::clear ( )
inline

◆ getAttachedObjects()

std::map<std::string, moveit_msgs::AttachedCollisionObject> moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getAttachedObjects ( const std::vector< std::string > &  object_ids)
inline

◆ getKnownObjectNames()

std::vector<std::string> moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getKnownObjectNames ( bool  with_type)
inline

◆ getKnownObjectNamesInROI()

std::vector<std::string> moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getKnownObjectNamesInROI ( double  minx,
double  miny,
double  minz,
double  maxx,
double  maxy,
double  maxz,
bool  with_type,
std::vector< std::string > &  types 
)
inline

◆ getObjectPoses()

std::map<std::string, geometry_msgs::Pose> moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getObjectPoses ( const std::vector< std::string > &  object_ids)
inline

◆ getObjects()

std::map<std::string, moveit_msgs::CollisionObject> moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getObjects ( const std::vector< std::string > &  object_ids)
inline

◆ getPlanningSceneMsg()

moveit_msgs::PlanningScene moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getPlanningSceneMsg ( uint32_t  components)
inline

◆ removeCollisionObjects()

void moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::removeCollisionObjects ( const std::vector< std::string > &  object_ids) const
inline

◆ waitForService()

void moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::waitForService ( ros::ServiceClient srv)
inlineprivate

Member Data Documentation

◆ apply_planning_scene_service_

ros::ServiceClient moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::apply_planning_scene_service_
private

◆ node_handle_

ros::NodeHandle moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::node_handle_
private

◆ planning_scene_diff_publisher_

ros::Publisher moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::planning_scene_diff_publisher_
private

◆ planning_scene_service_

ros::ServiceClient moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::planning_scene_service_
private

◆ robot_model_

moveit::core::RobotModelConstPtr moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::robot_model_
private

The documentation for this class was generated from the following file:


planning_interface
Author(s): Ioan Sucan
autogenerated on Sun Mar 3 2024 03:25:16