moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Macros
trajectory_generation_exceptions.h File Reference
#include <stdexcept>
#include <string>
#include <moveit_msgs/msg/move_it_error_codes.hpp>
Include dependency graph for trajectory_generation_exceptions.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  pilz_industrial_motion_planner::MoveItErrorCodeException
 Exception storing an moveit_msgs::msg::MoveItErrorCodes value. More...
 
class  pilz_industrial_motion_planner::TemplatedMoveItErrorCodeException< ERROR_CODE >
 

Namespaces

 pilz_industrial_motion_planner
 

Macros

#define CREATE_MOVEIT_ERROR_CODE_EXCEPTION(EXCEPTION_CLASS_NAME, ERROR_CODE)
 

Macro Definition Documentation

◆ CREATE_MOVEIT_ERROR_CODE_EXCEPTION

#define CREATE_MOVEIT_ERROR_CODE_EXCEPTION (   EXCEPTION_CLASS_NAME,
  ERROR_CODE 
)
Value:
class EXCEPTION_CLASS_NAME : public TemplatedMoveItErrorCodeException<ERROR_CODE> \
{ \
public: \
EXCEPTION_CLASS_NAME(const std::string& msg) : TemplatedMoveItErrorCodeException(msg) \
{ \
} \
\
EXCEPTION_CLASS_NAME(const std::string& msg, const moveit_msgs::msg::MoveItErrorCodes::_val_type& error_code) \
: TemplatedMoveItErrorCodeException(msg, error_code) \
{ \
} \
}

Definition at line 108 of file trajectory_generation_exceptions.h.