30 #ifndef RVIZ_INTERACTIVE_MARKER_TOOLS_H 31 #define RVIZ_INTERACTIVE_MARKER_TOOLS_H 33 #include <visualization_msgs/InteractiveMarker.h> 42 void autoComplete( visualization_msgs::InteractiveMarker &msg,
bool enable_autocomplete_transparency =
true );
47 void autoComplete(
const visualization_msgs::InteractiveMarker &msg,
48 visualization_msgs::InteractiveMarkerControl &control,
bool enable_autocomplete_transparency =
true );
59 geometry_msgs::Quaternion
makeQuaternion(
float x,
float y,
float z );
68 void makeArrow(
const visualization_msgs::InteractiveMarker &msg,
69 visualization_msgs::InteractiveMarkerControl &control,
float pos );
74 void makeDisc(
const visualization_msgs::InteractiveMarker &msg,
75 visualization_msgs::InteractiveMarkerControl &control,
float width = 0.3 );
81 visualization_msgs::InteractiveMarkerControl &control, std::string text );
84 void assignDefaultColor(visualization_msgs::Marker &marker,
const geometry_msgs::Quaternion &quat );
87 visualization_msgs::InteractiveMarkerControl
makeTitle(
const visualization_msgs::InteractiveMarker &msg );
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
visualization_msgs::InteractiveMarkerControl makeTitle(const visualization_msgs::InteractiveMarker &msg)
create a control which shows the description of the interactive marker
void autoComplete(visualization_msgs::InteractiveMarker &msg, bool enable_autocomplete_transparency=true)
fill in default values & insert default controls when none are specified.
void uniqueifyControlNames(visualization_msgs::InteractiveMarker &msg)
Make sure all the control names are unique within the given msg.
geometry_msgs::Quaternion makeQuaternion(float x, float y, float z)
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 makeArrow(const visualization_msgs::InteractiveMarker &msg, visualization_msgs::InteractiveMarkerControl &control, float pos)
— marker helpers —
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 ...