moveit2
The MoveIt Motion Planning Framework for ROS 2.
Functions
moveit_py::bind_planning_scene Namespace Reference

Functions

void applyCollisionObject (std::shared_ptr< planning_scene::PlanningScene > &planning_scene, moveit_msgs::msg::CollisionObject &collision_object_msg, std::optional< moveit_msgs::msg::ObjectColor > color_msg)
 
Eigen::MatrixXd getFrameTransform (std::shared_ptr< planning_scene::PlanningScene > &planning_scene, const std::string &id)
 
moveit_msgs::msg::PlanningScene getPlanningSceneMsg (std::shared_ptr< planning_scene::PlanningScene > &planning_scene)
 
void initPlanningScene (py::module &m)
 

Function Documentation

◆ applyCollisionObject()

void moveit_py::bind_planning_scene::applyCollisionObject ( std::shared_ptr< planning_scene::PlanningScene > &  planning_scene,
moveit_msgs::msg::CollisionObject &  collision_object_msg,
std::optional< moveit_msgs::msg::ObjectColor >  color_msg 
)

Definition at line 45 of file planning_scene.cpp.

Here is the caller graph for this function:

◆ getFrameTransform()

Eigen::MatrixXd moveit_py::bind_planning_scene::getFrameTransform ( std::shared_ptr< planning_scene::PlanningScene > &  planning_scene,
const std::string &  id 
)

Definition at line 60 of file planning_scene.cpp.

Here is the caller graph for this function:

◆ getPlanningSceneMsg()

moveit_msgs::msg::PlanningScene moveit_py::bind_planning_scene::getPlanningSceneMsg ( std::shared_ptr< planning_scene::PlanningScene > &  planning_scene)

Definition at line 66 of file planning_scene.cpp.

Here is the caller graph for this function:

◆ initPlanningScene()

void moveit_py::bind_planning_scene::initPlanningScene ( py::module &  m)

Definition at line 73 of file planning_scene.cpp.

Here is the call graph for this function:
Here is the caller graph for this function: