Namespaces | |
namespace | interactive_marker_server |
namespace | menu_handler |
Classes | |
class | InitFailException |
class | InteractiveMarkerClient |
class | InteractiveMarkerServer |
class | MenuHandler |
class | MessageContext |
class | SingleClient |
class | StateMachine |
Functions | |
void | assignDefaultColor (visualization_msgs::Marker &marker, const geometry_msgs::Quaternion &quat) |
assign an RGB value to the given marker based on the given orientation | |
void | autoComplete (visualization_msgs::InteractiveMarker &msg, bool enable_autocomplete_transparency=true) |
fill in default values & insert default controls when none are specified. | |
void | autoComplete (const visualization_msgs::InteractiveMarker &msg, visualization_msgs::InteractiveMarkerControl &control, bool enable_autocomplete_transparency=true) |
fill in default values & insert default controls when none are specified | |
void | makeArrow (const visualization_msgs::InteractiveMarker &msg, visualization_msgs::InteractiveMarkerControl &control, float pos) |
make a default-style arrow marker based on the properties of the given interactive marker | |
void | makeDisc (const visualization_msgs::InteractiveMarker &msg, visualization_msgs::InteractiveMarkerControl &control, float width=0.3) |
make a default-style disc marker (e.g for rotating) based on the properties of the given interactive marker | |
geometry_msgs::Quaternion | makeQuaternion (float x, float y, float z) |
visualization_msgs::InteractiveMarkerControl | makeTitle (const visualization_msgs::InteractiveMarker &msg) |
create a control which shows the description of the interactive marker | |
void | makeViewFacingButton (const visualization_msgs::InteractiveMarker &msg, visualization_msgs::InteractiveMarkerControl &control, std::string text) |
make a box which shows the given text and is view facing | |
void | uniqueifyControlNames (visualization_msgs::InteractiveMarker &msg) |
Make sure all the control names are unique within the given msg. |
void interactive_markers::assignDefaultColor | ( | visualization_msgs::Marker & | marker, |
const geometry_msgs::Quaternion & | quat | ||
) |
void interactive_markers::autoComplete | ( | visualization_msgs::InteractiveMarker & | msg, |
bool | enable_autocomplete_transparency = true |
||
) |
fill in default values & insert default controls when none are specified.
This also calls uniqueifyControlNames().
msg | interactive marker to be completed |
void interactive_markers::autoComplete | ( | const visualization_msgs::InteractiveMarker & | msg, |
visualization_msgs::InteractiveMarkerControl & | control, | ||
bool | enable_autocomplete_transparency = true |
||
) |
void interactive_markers::makeArrow | ( | const visualization_msgs::InteractiveMarker & | msg, |
visualization_msgs::InteractiveMarkerControl & | control, | ||
float | pos | ||
) |
make a default-style arrow marker based on the properties of the given interactive marker
--- marker helpers ---
msg | the interactive marker that this will go into |
control | the control where to insert the arrow marker |
pos | how far from the center should the arrow be, and on which side |
void interactive_markers::makeDisc | ( | const visualization_msgs::InteractiveMarker & | msg, |
visualization_msgs::InteractiveMarkerControl & | control, | ||
float | width = 0.3 |
||
) |
geometry_msgs::Quaternion interactive_markers::makeQuaternion | ( | float | x, |
float | y, | ||
float | z | ||
) |
make a quaternion with a fixed local x axis. The rotation around that axis will be chosen automatically.
x,y,z | the designated x axis |
visualization_msgs::InteractiveMarkerControl interactive_markers::makeTitle | ( | const visualization_msgs::InteractiveMarker & | msg | ) |
void interactive_markers::makeViewFacingButton | ( | const visualization_msgs::InteractiveMarker & | msg, |
visualization_msgs::InteractiveMarkerControl & | control, | ||
std::string | text | ||
) |
void interactive_markers::uniqueifyControlNames | ( | visualization_msgs::InteractiveMarker & | msg | ) |