#include <move_arm_warehouse/move_arm_utils.h>
#include <assert.h>
#include <geometric_shapes/shape_operations.h>
#include <planning_environment/util/construct_object.h>
Go to the source code of this file.
Defines | |
#define | MARKER_REFRESH_TIME 0.05 |
#define | NOT_MOVING_TIME_THRESHOLD 0.5 |
#define | NOT_MOVING_VELOCITY_THRESHOLD 0.005 |
#define | SAFE_DELETE(x) if(x != NULL) { delete x; x = NULL; } |
Functions | |
std_msgs::ColorRGBA | makeRandomColor (float brightness, float alpha) |
#define MARKER_REFRESH_TIME 0.05 |
Definition at line 62 of file move_arm_utils.cpp.
#define NOT_MOVING_TIME_THRESHOLD 0.5 |
Definition at line 65 of file move_arm_utils.cpp.
#define NOT_MOVING_VELOCITY_THRESHOLD 0.005 |
Definition at line 64 of file move_arm_utils.cpp.
#define SAFE_DELETE | ( | x | ) | if(x != NULL) { delete x; x = NULL; } |
Definition at line 63 of file move_arm_utils.cpp.
std_msgs::ColorRGBA makeRandomColor | ( | float | brightness, |
float | alpha | ||
) |
Definition at line 67 of file move_arm_utils.cpp.