39#include <pybind11/pybind11.h>
40#include <pybind11/eigen.h>
41#include <pybind11/stl.h>
42#include <moveit_msgs/msg/robot_state.hpp>
43#include <moveit_msgs/msg/move_it_error_codes.hpp>
51namespace bind_planning_interface
53std::shared_ptr<robot_trajectory::RobotTrajectory>
56moveit_msgs::msg::RobotState
59moveit_msgs::msg::MoveItErrorCodes
std::shared_ptr< robot_trajectory::RobotTrajectory > getMotionPlanResponseTrajectory(std::shared_ptr< planning_interface::MotionPlanResponse > &response)
moveit_msgs::msg::MoveItErrorCodes getMotionPlanResponseErrorCode(std::shared_ptr< planning_interface::MotionPlanResponse > &response)
void initMotionPlanResponse(py::module &m)
moveit_msgs::msg::RobotState getMotionPlanResponseStartState(std::shared_ptr< planning_interface::MotionPlanResponse > &response)
double getMotionPlanResponsePlanningTime(std::shared_ptr< planning_interface::MotionPlanResponse > &response)
std::string getMotionPlanResponsePlannerId(std::shared_ptr< planning_interface::MotionPlanResponse > &response)