rapid
A ROS robotics library.
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Pages
moveit_error_code.h
Go to the documentation of this file.
1 #ifndef _RAPID_MOVEIT_ERROR_CODE_H_
2 #define _RAPID_MOVEIT_ERROR_CODE_H_
3 
4 #include <string>
5 
6 #include "moveit/move_group_interface/move_group.h"
7 #include "moveit_msgs/MoveItErrorCodes.h"
8 
9 namespace rapid {
32 bool IsSuccess(const moveit::planning_interface::MoveItErrorCode& error_code);
33 
38 bool IsSuccess(const moveit_msgs::MoveItErrorCodes& error_code);
39 
45 std::string ErrorString(
46  const moveit::planning_interface::MoveItErrorCode& error_code);
47 
53 std::string ErrorString(const moveit_msgs::MoveItErrorCodes& error_code);
54 
55 } // namespace pbi
56 
57 #endif // _PBI_MOVEIT_ERROR_CODE_H_
bool IsSuccess(const moveit::planning_interface::MoveItErrorCode &error_code)
Returns true if the error code corresponds to success.
std::string ErrorString(const moveit::planning_interface::MoveItErrorCode &error_code)
Returns a string describing the given MoveIt error code.