rapid
A ROS robotics library.
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Pages
moveit_error_code.h File Reference
#include <string>
#include "moveit/move_group_interface/move_group.h"
#include "moveit_msgs/MoveItErrorCodes.h"

Go to the source code of this file.

Namespaces

 rapid
 

Functions

bool rapid::IsSuccess (const moveit::planning_interface::MoveItErrorCode &error_code)
 Returns true if the error code corresponds to success. More...
 
bool rapid::IsSuccess (const moveit_msgs::MoveItErrorCodes &error_code)
 Returns true if the error code corresponds to success. More...
 
std::string rapid::ErrorString (const moveit::planning_interface::MoveItErrorCode &error_code)
 Returns a string describing the given MoveIt error code. More...
 
std::string rapid::ErrorString (const moveit_msgs::MoveItErrorCodes &error_code)
 Returns a string describing the given MoveIt error code. More...