|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <pybind11/pybind11.h>#include <pybind11/stl.h>#include <pybind11/eigen.h>#include <moveit/robot_trajectory/robot_trajectory.hpp>#include <moveit_msgs/msg/robot_trajectory.hpp>#include <rclcpp/rclcpp.hpp>

Go to the source code of this file.
Namespaces | |
| namespace | moveit_py |
| namespace | moveit_py::bind_robot_trajectory |
Functions | |
| moveit_msgs::msg::RobotTrajectory | moveit_py::bind_robot_trajectory::getRobotTrajectoryMsg (const robot_trajectory::RobotTrajectoryConstPtr &robot_trajectory, const std::vector< std::string > &joint_filter) |
| robot_trajectory::RobotTrajectory | moveit_py::bind_robot_trajectory::setRobotTrajectoryMsg (const std::shared_ptr< robot_trajectory::RobotTrajectory > &robot_trajectory, const moveit::core::RobotState &robot_state, const moveit_msgs::msg::RobotTrajectory &msg) |
| void | moveit_py::bind_robot_trajectory::initRobotTrajectory (py::module &m) |