moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | List of all members
moveit::hybrid_planning::MoveItErrorCode Class Reference

#include <moveit_error_code_interface.h>

Inheritance diagram for moveit::hybrid_planning::MoveItErrorCode:
Inheritance graph
[legend]
Collaboration diagram for moveit::hybrid_planning::MoveItErrorCode:
Collaboration graph
[legend]

Public Member Functions

 MoveItErrorCode ()
 
 MoveItErrorCode (int code)
 
 MoveItErrorCode (const moveit_msgs::msg::MoveItErrorCodes &code)
 
 operator bool () const
 
bool operator== (const int code) const
 
bool operator!= (const int code) const
 

Detailed Description

Definition at line 43 of file moveit_error_code_interface.h.

Constructor & Destructor Documentation

◆ MoveItErrorCode() [1/3]

moveit::hybrid_planning::MoveItErrorCode::MoveItErrorCode ( )
inline

Definition at line 46 of file moveit_error_code_interface.h.

◆ MoveItErrorCode() [2/3]

moveit::hybrid_planning::MoveItErrorCode::MoveItErrorCode ( int  code)
inline

Definition at line 50 of file moveit_error_code_interface.h.

◆ MoveItErrorCode() [3/3]

moveit::hybrid_planning::MoveItErrorCode::MoveItErrorCode ( const moveit_msgs::msg::MoveItErrorCodes &  code)
inline

Definition at line 54 of file moveit_error_code_interface.h.

Member Function Documentation

◆ operator bool()

moveit::hybrid_planning::MoveItErrorCode::operator bool ( ) const
inlineexplicit

Definition at line 58 of file moveit_error_code_interface.h.

◆ operator!=()

bool moveit::hybrid_planning::MoveItErrorCode::operator!= ( const int  code) const
inline

Definition at line 66 of file moveit_error_code_interface.h.

◆ operator==()

bool moveit::hybrid_planning::MoveItErrorCode::operator== ( const int  code) const
inline

Definition at line 62 of file moveit_error_code_interface.h.


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