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

Functions

void apply_collision_object (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 get_frame_transform (std::shared_ptr< planning_scene::PlanningScene > &planning_scene, const std::string &id)
 
moveit_msgs::msg::PlanningScene get_planning_scene_msg (std::shared_ptr< planning_scene::PlanningScene > &planning_scene)
 
void init_planning_scene (py::module &m)
 

Function Documentation

◆ apply_collision_object()

void moveit_py::bind_planning_scene::apply_collision_object ( 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:

◆ get_frame_transform()

Eigen::MatrixXd moveit_py::bind_planning_scene::get_frame_transform ( 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:

◆ get_planning_scene_msg()

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

Definition at line 67 of file planning_scene.cpp.

Here is the caller graph for this function:

◆ init_planning_scene()

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

Definition at line 74 of file planning_scene.cpp.

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