moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | List of all members
moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl Class Reference

Public Member Functions

 PlanningSceneInterfaceImpl (const std::string &ns="", bool wait=true)
 
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::msg::Pose > getObjectPoses (const std::vector< std::string > &object_ids)
 
std::map< std::string, moveit_msgs::msg::CollisionObject > getObjects (const std::vector< std::string > &object_ids)
 
std::map< std::string, moveit_msgs::msg::AttachedCollisionObject > getAttachedObjects (const std::vector< std::string > &object_ids)
 
bool applyPlanningScene (const moveit_msgs::msg::PlanningScene &planning_scene)
 
void addCollisionObjects (const std::vector< moveit_msgs::msg::CollisionObject > &collision_objects, const std::vector< moveit_msgs::msg::ObjectColor > &object_colors) const
 
void removeCollisionObjects (const std::vector< std::string > &object_ids) const
 

Detailed Description

Definition at line 51 of file planning_scene_interface.cpp.

Constructor & Destructor Documentation

◆ PlanningSceneInterfaceImpl()

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

Definition at line 54 of file planning_scene_interface.cpp.

Here is the call graph for this function:

Member Function Documentation

◆ addCollisionObjects()

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

Definition at line 247 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

◆ applyPlanningScene()

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

Definition at line 232 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

◆ getAttachedObjects()

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

Definition at line 205 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

◆ getKnownObjectNames()

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

Definition at line 75 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

◆ 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

Definition at line 105 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

◆ getObjectPoses()

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

Definition at line 157 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

◆ getObjects()

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

Definition at line 179 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

◆ removeCollisionObjects()

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

Definition at line 270 of file planning_scene_interface.cpp.

Here is the caller graph for this function:

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