Namespaces | Classes | Functions
interactive_markers Namespace Reference

Namespaces

 interactive_marker_server
 
 menu_handler
 

Classes

class  InitFailException
 
class  InteractiveMarkerClient
 
class  InteractiveMarkerServer
 
class  MenuHandler
 
class  MessageContext
 
class  SingleClient
 
class  StateMachine
 

Functions

INTERACTIVE_MARKERS_PUBLIC void assignDefaultColor (visualization_msgs::Marker &marker, const geometry_msgs::Quaternion &quat)
 assign an RGB value to the given marker based on the given orientation More...
 
INTERACTIVE_MARKERS_PUBLIC 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 More...
 
INTERACTIVE_MARKERS_PUBLIC void autoComplete (visualization_msgs::InteractiveMarker &msg, bool enable_autocomplete_transparency=true)
 fill in default values & insert default controls when none are specified. More...
 
INTERACTIVE_MARKERS_PUBLIC void makeArrow (const visualization_msgs::InteractiveMarker &msg, visualization_msgs::InteractiveMarkerControl &control, float pos)
 — marker helpers — More...
 
INTERACTIVE_MARKERS_PUBLIC 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 More...
 
INTERACTIVE_MARKERS_PUBLIC geometry_msgs::Quaternion makeQuaternion (float x, float y, float z)
 
INTERACTIVE_MARKERS_PUBLIC visualization_msgs::InteractiveMarkerControl makeTitle (const visualization_msgs::InteractiveMarker &msg)
 create a control which shows the description of the interactive marker More...
 
INTERACTIVE_MARKERS_PUBLIC 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 More...
 
INTERACTIVE_MARKERS_PUBLIC void uniqueifyControlNames (visualization_msgs::InteractiveMarker &msg)
 Make sure all the control names are unique within the given msg. More...
 

Function Documentation

◆ assignDefaultColor()

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 396 of file tools.cpp.

◆ autoComplete() [1/2]

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

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

Definition at line 101 of file tools.cpp.

◆ autoComplete() [2/2]

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().

Parameters
msginteractive marker to be completed

Definition at line 44 of file tools.cpp.

◆ makeArrow()

void interactive_markers::makeArrow ( const visualization_msgs::InteractiveMarker &  msg,
visualization_msgs::InteractiveMarkerControl &  control,
float  pos 
)

— marker helpers —

make a default-style arrow marker based on the properties of the given interactive marker

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 198 of file tools.cpp.

◆ makeDisc()

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 226 of file tools.cpp.

◆ makeQuaternion()

INTERACTIVE_MARKERS_PUBLIC 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

◆ makeTitle()

visualization_msgs::InteractiveMarkerControl interactive_markers::makeTitle ( const visualization_msgs::InteractiveMarker &  msg)

create a control which shows the description of the interactive marker

Definition at line 419 of file tools.cpp.

◆ makeViewFacingButton()

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 369 of file tools.cpp.

◆ uniqueifyControlNames()

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, William Woodall
autogenerated on Fri Oct 27 2023 02:31:54