SMACC2
Loading...
Searching...
No Matches
cl_moveit2z::JointTrajectoryResult Struct Reference

Result of a joint space trajectory planning operation. More...

#include <cp_joint_space_trajectory_planner.hpp>

Collaboration diagram for cl_moveit2z::JointTrajectoryResult:
Collaboration graph

Public Member Functions

 JointTrajectoryResult ()
 

Public Attributes

bool success
 
JointTrajectoryErrorCode errorCode
 
moveit_msgs::msg::RobotTrajectory trajectory
 
std::string errorMessage
 
std::vector< int > discontinuityIndexes
 

Detailed Description

Result of a joint space trajectory planning operation.

Definition at line 69 of file cp_joint_space_trajectory_planner.hpp.

Constructor & Destructor Documentation

◆ JointTrajectoryResult()

Member Data Documentation

◆ discontinuityIndexes

std::vector<int> cl_moveit2z::JointTrajectoryResult::discontinuityIndexes

Definition at line 75 of file cp_joint_space_trajectory_planner.hpp.

◆ errorCode

JointTrajectoryErrorCode cl_moveit2z::JointTrajectoryResult::errorCode

Definition at line 72 of file cp_joint_space_trajectory_planner.hpp.

◆ errorMessage

std::string cl_moveit2z::JointTrajectoryResult::errorMessage

Definition at line 74 of file cp_joint_space_trajectory_planner.hpp.

◆ success

bool cl_moveit2z::JointTrajectoryResult::success

Definition at line 71 of file cp_joint_space_trajectory_planner.hpp.

◆ trajectory

moveit_msgs::msg::RobotTrajectory cl_moveit2z::JointTrajectoryResult::trajectory

Definition at line 73 of file cp_joint_space_trajectory_planner.hpp.


The documentation for this struct was generated from the following file: