moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | List of all members
pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE > Class Template Reference

#include <trajectory_generation_exceptions.h>

Inheritance diagram for pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >:
Inheritance graph
[legend]
Collaboration diagram for pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >:
Collaboration graph
[legend]

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
 
MoveItErrorCodeExceptionoperator= (const MoveItErrorCodeException &)=default
 
MoveItErrorCodeExceptionoperator= (MoveItErrorCodeException &&)=default
 

Detailed Description

template<moveit_msgs::msg::MoveItErrorCodes::_val_type ERROR_CODE = moveit_msgs::msg::MoveItErrorCodes::FAILURE>
class pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >

Definition at line 65 of file trajectory_generation_exceptions.h.

Constructor & Destructor Documentation

◆ TemplatedMoveItErrorCodeException() [1/2]

template<moveit_msgs::msg::MoveItErrorCodes::_val_type ERROR_CODE>
pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >::TemplatedMoveItErrorCodeException ( const std::string &  msg)
inline

Definition at line 85 of file trajectory_generation_exceptions.h.

◆ TemplatedMoveItErrorCodeException() [2/2]

template<moveit_msgs::msg::MoveItErrorCodes::_val_type ERROR_CODE>
pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >::TemplatedMoveItErrorCodeException ( const std::string &  msg,
const moveit_msgs::msg::MoveItErrorCodes::_val_type &  error_code 
)
inline

Definition at line 91 of file trajectory_generation_exceptions.h.

Member Function Documentation

◆ getErrorCode()

template<moveit_msgs::msg::MoveItErrorCodes::_val_type ERROR_CODE>
const moveit_msgs::msg::MoveItErrorCodes::_val_type & pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >::getErrorCode
inlineoverridevirtual

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