Classes | |
class | RobotInteraction |
Functions | |
void | add6DOFControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
void | addErrorMarker (visualization_msgs::InteractiveMarker &im) |
void | addOrientationControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
void | addPlanarXYControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
void | addPositionControl (visualization_msgs::InteractiveMarker &int_marker, bool orientation_fixed=false) |
void | addTArrowMarker (visualization_msgs::InteractiveMarker &im) |
void | addViewPlaneControl (visualization_msgs::InteractiveMarker &int_marker, double radius, const std_msgs::ColorRGBA &color, bool position=true, bool orientation=true) |
static std::string | getMarkerName (const RobotInteraction::InteractionHandlerPtr &handler, const RobotInteraction::EndEffector &eef) |
static std::string | getMarkerName (const RobotInteraction::InteractionHandlerPtr &handler, const RobotInteraction::Joint &vj) |
static std::string | getMarkerName (const RobotInteraction::InteractionHandlerPtr &handler, const RobotInteraction::Generic &g) |
visualization_msgs::InteractiveMarker | make6DOFMarker (const std::string &name, const geometry_msgs::PoseStamped &stamped, double scale, bool orientation_fixed=false) |
visualization_msgs::InteractiveMarker | makeEmptyInteractiveMarker (const std::string &name, const geometry_msgs::PoseStamped &stamped, double scale) |
visualization_msgs::InteractiveMarker | makePlanarXYMarker (const std::string &name, const geometry_msgs::PoseStamped &stamped, double scale, bool orientation_fixed=false) |
MOVEIT_CLASS_FORWARD (RobotInteraction) | |
Variables | |
static const float | END_EFFECTOR_COLLISION_COLOR [4] = { 0.8, 0.8, 0.0, 1.0 } |
static const float | END_EFFECTOR_REACHABLE_COLOR [4] = { 0.2, 1.0, 0.2, 1.0 } |
static const float | END_EFFECTOR_UNREACHABLE_COLOR [4] = { 1.0, 0.3, 0.3, 1.0 } |
static const float | END_EFFECTOR_WHITE_COLOR [4] = { 1.0, 1.0, 1.0, 1.0 } |
void robot_interaction::add6DOFControl | ( | visualization_msgs::InteractiveMarker & | int_marker, |
bool | orientation_fixed = false |
||
) |
Definition at line 161 of file interactive_marker_helpers.cpp.
void robot_interaction::addErrorMarker | ( | visualization_msgs::InteractiveMarker & | im | ) |
Definition at line 104 of file interactive_marker_helpers.cpp.
void robot_interaction::addOrientationControl | ( | visualization_msgs::InteractiveMarker & | int_marker, |
bool | orientation_fixed = false |
||
) |
Definition at line 167 of file interactive_marker_helpers.cpp.
void robot_interaction::addPlanarXYControl | ( | visualization_msgs::InteractiveMarker & | int_marker, |
bool | orientation_fixed = false |
||
) |
Definition at line 133 of file interactive_marker_helpers.cpp.
void robot_interaction::addPositionControl | ( | visualization_msgs::InteractiveMarker & | int_marker, |
bool | orientation_fixed = false |
||
) |
Definition at line 195 of file interactive_marker_helpers.cpp.
void robot_interaction::addTArrowMarker | ( | visualization_msgs::InteractiveMarker & | im | ) |
Definition at line 50 of file interactive_marker_helpers.cpp.
void robot_interaction::addViewPlaneControl | ( | visualization_msgs::InteractiveMarker & | int_marker, |
double | radius, | ||
const std_msgs::ColorRGBA & | color, | ||
bool | position = true , |
||
bool | orientation = true |
||
) |
Definition at line 223 of file interactive_marker_helpers.cpp.
static std::string robot_interaction::getMarkerName | ( | const RobotInteraction::InteractionHandlerPtr & | handler, |
const RobotInteraction::EndEffector & | eef | ||
) | [inline, static] |
Definition at line 744 of file robot_interaction.cpp.
static std::string robot_interaction::getMarkerName | ( | const RobotInteraction::InteractionHandlerPtr & | handler, |
const RobotInteraction::Joint & | vj | ||
) | [inline, static] |
Definition at line 749 of file robot_interaction.cpp.
static std::string robot_interaction::getMarkerName | ( | const RobotInteraction::InteractionHandlerPtr & | handler, |
const RobotInteraction::Generic & | g | ||
) | [inline, static] |
Definition at line 754 of file robot_interaction.cpp.
visualization_msgs::InteractiveMarker robot_interaction::make6DOFMarker | ( | const std::string & | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
double | scale, | ||
bool | orientation_fixed = false |
||
) |
Definition at line 260 of file interactive_marker_helpers.cpp.
visualization_msgs::InteractiveMarker robot_interaction::makeEmptyInteractiveMarker | ( | const std::string & | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
double | scale | ||
) |
Definition at line 38 of file interactive_marker_helpers.cpp.
visualization_msgs::InteractiveMarker robot_interaction::makePlanarXYMarker | ( | const std::string & | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
double | scale, | ||
bool | orientation_fixed = false |
||
) |
Definition at line 250 of file interactive_marker_helpers.cpp.
robot_interaction::MOVEIT_CLASS_FORWARD | ( | RobotInteraction | ) |
const float robot_interaction::END_EFFECTOR_COLLISION_COLOR[4] = { 0.8, 0.8, 0.0, 1.0 } [static] |
Definition at line 53 of file robot_interaction.cpp.
const float robot_interaction::END_EFFECTOR_REACHABLE_COLOR[4] = { 0.2, 1.0, 0.2, 1.0 } [static] |
Definition at line 51 of file robot_interaction.cpp.
const float robot_interaction::END_EFFECTOR_UNREACHABLE_COLOR[4] = { 1.0, 0.3, 0.3, 1.0 } [static] |
Definition at line 50 of file robot_interaction.cpp.
const float robot_interaction::END_EFFECTOR_WHITE_COLOR[4] = { 1.0, 1.0, 1.0, 1.0 } [static] |
Definition at line 52 of file robot_interaction.cpp.