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

Functions

rclcpp::Logger getLogger ()
 
std::shared_ptr< moveit_cpp::PlanningComponentgetPlanningComponent (std::shared_ptr< moveit_cpp::MoveItCpp > &moveit_cpp_ptr, const std::string &planning_component)
 
void initMoveitPy (py::module &m)
 

Function Documentation

◆ getLogger()

rclcpp::Logger moveit_py::bind_moveit_cpp::getLogger ( )

Definition at line 44 of file moveit_cpp.cpp.

Here is the call graph for this function:

◆ getPlanningComponent()

std::shared_ptr<moveit_cpp::PlanningComponent> moveit_py::bind_moveit_cpp::getPlanningComponent ( std::shared_ptr< moveit_cpp::MoveItCpp > &  moveit_cpp_ptr,
const std::string &  planning_component 
)

Definition at line 50 of file moveit_cpp.cpp.

◆ initMoveitPy()

void moveit_py::bind_moveit_cpp::initMoveitPy ( py::module &  m)

Definition at line 55 of file moveit_cpp.cpp.

Here is the caller graph for this function: