|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <cartesian_trajectory_point.hpp>

Public Attributes | |
| geometry_msgs::msg::Pose | pose |
| geometry_msgs::msg::Twist | velocity |
| geometry_msgs::msg::Twist | acceleration |
| rclcpp::Duration | time_from_start { 0, 0 } |
Definition at line 44 of file cartesian_trajectory_point.hpp.
| geometry_msgs::msg::Twist pilz_industrial_motion_planner::CartesianTrajectoryPoint::acceleration |
Definition at line 48 of file cartesian_trajectory_point.hpp.
| geometry_msgs::msg::Pose pilz_industrial_motion_planner::CartesianTrajectoryPoint::pose |
Definition at line 46 of file cartesian_trajectory_point.hpp.
| rclcpp::Duration pilz_industrial_motion_planner::CartesianTrajectoryPoint::time_from_start { 0, 0 } |
Definition at line 49 of file cartesian_trajectory_point.hpp.
| geometry_msgs::msg::Twist pilz_industrial_motion_planner::CartesianTrajectoryPoint::velocity |
Definition at line 47 of file cartesian_trajectory_point.hpp.