moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <trajectory_generation_exceptions.h>
Public Member Functions | |
TemplatedMoveItErrorCodeException (const std::string &msg) | |
TemplatedMoveItErrorCodeException (const std::string &msg, const moveit_msgs::msg::MoveItErrorCodes::_val_type &error_code) | |
const moveit_msgs::msg::MoveItErrorCodes::_val_type & | getErrorCode () const override |
Public Member Functions inherited from pilz_industrial_motion_planner::MoveItErrorCodeException | |
MoveItErrorCodeException (const std::string &msg) | |
Additional Inherited Members | |
Protected Member Functions inherited from pilz_industrial_motion_planner::MoveItErrorCodeException | |
MoveItErrorCodeException (const MoveItErrorCodeException &)=default | |
MoveItErrorCodeException (MoveItErrorCodeException &&)=default | |
~MoveItErrorCodeException () override=default | |
MoveItErrorCodeException & | operator= (const MoveItErrorCodeException &)=default |
MoveItErrorCodeException & | operator= (MoveItErrorCodeException &&)=default |
Definition at line 65 of file trajectory_generation_exceptions.h.
|
inline |
Definition at line 85 of file trajectory_generation_exceptions.h.
|
inline |
Definition at line 91 of file trajectory_generation_exceptions.h.
|
inlineoverridevirtual |
Implements pilz_industrial_motion_planner::MoveItErrorCodeException.
Definition at line 99 of file trajectory_generation_exceptions.h.