moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | Protected Member Functions | List of all members
pilz_industrial_motion_planner::MoveItErrorCodeException Class Referenceabstract

Exception storing an moveit_msgs::msg::MoveItErrorCodes value. More...

#include <trajectory_generation_exceptions.h>

Inheritance diagram for pilz_industrial_motion_planner::MoveItErrorCodeException:
Inheritance graph
[legend]
Collaboration diagram for pilz_industrial_motion_planner::MoveItErrorCodeException:
Collaboration graph
[legend]

Public Member Functions

 MoveItErrorCodeException (const std::string &msg)
 
virtual const moveit_msgs::msg::MoveItErrorCodes::_val_type & getErrorCode () const =0
 

Protected Member Functions

 MoveItErrorCodeException (const MoveItErrorCodeException &)=default
 
 MoveItErrorCodeException (MoveItErrorCodeException &&)=default
 
 ~MoveItErrorCodeException () override=default
 
MoveItErrorCodeExceptionoperator= (const MoveItErrorCodeException &)=default
 
MoveItErrorCodeExceptionoperator= (MoveItErrorCodeException &&)=default
 

Detailed Description

Exception storing an moveit_msgs::msg::MoveItErrorCodes value.

Definition at line 47 of file trajectory_generation_exceptions.h.

Constructor & Destructor Documentation

◆ MoveItErrorCodeException() [1/3]

pilz_industrial_motion_planner::MoveItErrorCodeException::MoveItErrorCodeException ( const std::string &  msg)
inline

Definition at line 80 of file trajectory_generation_exceptions.h.

◆ MoveItErrorCodeException() [2/3]

pilz_industrial_motion_planner::MoveItErrorCodeException::MoveItErrorCodeException ( const MoveItErrorCodeException )
protecteddefault

◆ MoveItErrorCodeException() [3/3]

pilz_industrial_motion_planner::MoveItErrorCodeException::MoveItErrorCodeException ( MoveItErrorCodeException &&  )
protecteddefault

◆ ~MoveItErrorCodeException()

pilz_industrial_motion_planner::MoveItErrorCodeException::~MoveItErrorCodeException ( )
overrideprotecteddefault

Member Function Documentation

◆ getErrorCode()

virtual const moveit_msgs::msg::MoveItErrorCodes::_val_type& pilz_industrial_motion_planner::MoveItErrorCodeException::getErrorCode ( ) const
pure virtual

Implemented in pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >.

Here is the caller graph for this function:

◆ operator=() [1/2]

MoveItErrorCodeException& pilz_industrial_motion_planner::MoveItErrorCodeException::operator= ( const MoveItErrorCodeException )
protecteddefault

◆ operator=() [2/2]

MoveItErrorCodeException& pilz_industrial_motion_planner::MoveItErrorCodeException::operator= ( MoveItErrorCodeException &&  )
protecteddefault

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