Namespaces | Classes | Functions
interactive_markers Namespace Reference

Namespaces

namespace  interactive_marker_server
namespace  menu_handler

Classes

class  InteractiveMarkerServer
class  MenuHandler

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)
 fill in default values & insert default controls when none are specified.
void autoComplete (const visualization_msgs::InteractiveMarker &msg, visualization_msgs::InteractiveMarkerControl &control)
 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 (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.

Function Documentation

void interactive_markers::assignDefaultColor ( visualization_msgs::Marker &  marker,
const geometry_msgs::Quaternion &  quat 
)

assign an RGB value to the given marker based on the given orientation

Definition at line 430 of file tools.cpp.

void interactive_markers::autoComplete ( visualization_msgs::InteractiveMarker &  msg)

fill in default values & insert default controls when none are specified.

This also calls uniqueifyControlNames().

Parameters:
msginteractive marker to be completed

Definition at line 44 of file tools.cpp.

void interactive_markers::autoComplete ( const visualization_msgs::InteractiveMarker &  msg,
visualization_msgs::InteractiveMarkerControl &  control 
)

fill in default values & insert default controls when none are specified

Parameters:
msginteractive marker which contains the control
controlthe control to be completed

Definition at line 101 of file tools.cpp.

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 ---

Parameters:
msgthe interactive marker that this will go into
controlthe control where to insert the arrow marker
poshow far from the center should the arrow be, and on which side

Definition at line 248 of file tools.cpp.

void interactive_markers::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

Parameters:
msgthe interactive marker that this will go into
widthwidth of the disc, relative to its inner radius

Definition at line 276 of file tools.cpp.

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.

Parameters:
x,y,zthe designated x axis
visualization_msgs::InteractiveMarkerControl interactive_markers::makeTitle ( visualization_msgs::InteractiveMarker &  msg)

create a control which shows the description of the interactive marker

Definition at line 453 of file tools.cpp.

void interactive_markers::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

Parameters:
msgthe interactive marker that this will go into
textthe text to display

Definition at line 403 of file tools.cpp.

void interactive_markers::uniqueifyControlNames ( visualization_msgs::InteractiveMarker &  msg)

Make sure all the control names are unique within the given msg.

Appends _u0 _u1 etc to repeated names (not including the first of each). This is called by autoComplete( visualization_msgs::InteractiveMarker &msg ).

Definition at line 83 of file tools.cpp.



interactive_markers
Author(s): David Gossow (C++), Michael Ferguson (Python)
autogenerated on Mon Jan 6 2014 11:54:25