#include <interactive_markers/tools.h>
#include <visualization_msgs/InteractiveMarker.h>
#include <visualization_msgs/InteractiveMarkerControl.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MenuEntry.h>
#include <geometry_msgs/PoseStamped.h>
Go to the source code of this file.
Functions | |
void | add6DofControl (visualization_msgs::InteractiveMarker &msg, bool fixed=false) |
visualization_msgs::InteractiveMarker | make6DofMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing) |
visualization_msgs::InteractiveMarker | makeBaseMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed) |
visualization_msgs::Marker | makeBox (visualization_msgs::InteractiveMarker &msg) |
visualization_msgs::InteractiveMarkerControl & | makeBoxControl (visualization_msgs::InteractiveMarker &msg) |
visualization_msgs::InteractiveMarker | makeButtonBox (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing) |
visualization_msgs::InteractiveMarker | makeElevatorMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed) |
visualization_msgs::InteractiveMarker | makeEmptyMarker (const char *frame_id="") |
visualization_msgs::InteractiveMarker | makeGripperMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, std_msgs::ColorRGBA color, float angle, bool view_facing) |
visualization_msgs::InteractiveMarker | makeHeadGoalMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale) |
visualization_msgs::MenuEntry | makeMenuEntry (const char *title) |
visualization_msgs::MenuEntry | makeMenuEntry (const char *title, const char *command, int type) |
visualization_msgs::InteractiveMarker | makeMeshMarker (const std::string &name, const std::string &mesh_resource, const geometry_msgs::PoseStamped &stamped, float scale) |
visualization_msgs::InteractiveMarker | makeMeshMarker (const std::string &name, const std::string &mesh_resource, const geometry_msgs::PoseStamped &stamped, float scale, const std_msgs::ColorRGBA &color) |
visualization_msgs::InteractiveMarker | makeMeshMarker (const std::string &name, const std::string &mesh_resource, const geometry_msgs::PoseStamped &stamped, float scale, const std_msgs::ColorRGBA &color, bool use_color) |
visualization_msgs::InteractiveMarker | makePostureMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale, bool fixed, bool view_facing) |
visualization_msgs::InteractiveMarker | makeProjectorMarker (const char *name, const geometry_msgs::PoseStamped &stamped, float scale) |
visualization_msgs::Marker | makeSphere (visualization_msgs::InteractiveMarker &msg, double scale) |
void add6DofControl | ( | visualization_msgs::InteractiveMarker & | msg, |
bool | fixed = false |
||
) |
Definition at line 62 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker make6DofMarker | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
bool | fixed, | ||
bool | view_facing | ||
) |
Definition at line 236 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeBaseMarker | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
bool | fixed | ||
) |
Definition at line 326 of file marker_helpers.cpp.
visualization_msgs::Marker makeBox | ( | visualization_msgs::InteractiveMarker & | msg | ) |
Definition at line 46 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarkerControl& makeBoxControl | ( | visualization_msgs::InteractiveMarker & | msg | ) |
Definition at line 114 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeButtonBox | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
bool | fixed, | ||
bool | view_facing | ||
) |
Definition at line 219 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeElevatorMarker | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
bool | fixed | ||
) |
Definition at line 264 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeEmptyMarker | ( | const char * | frame_id = "" | ) |
Definition at line 37 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeGripperMarker | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
std_msgs::ColorRGBA | color, | ||
float | angle, | ||
bool | view_facing | ||
) |
Definition at line 405 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeHeadGoalMarker | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale | ||
) |
Definition at line 158 of file marker_helpers.cpp.
visualization_msgs::MenuEntry makeMenuEntry | ( | const char * | title | ) |
Definition at line 124 of file marker_helpers.cpp.
visualization_msgs::MenuEntry makeMenuEntry | ( | const char * | title, |
const char * | command, | ||
int | type | ||
) |
Definition at line 132 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeMeshMarker | ( | const std::string & | name, |
const std::string & | mesh_resource, | ||
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale | ||
) |
Definition at line 206 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeMeshMarker | ( | const std::string & | name, |
const std::string & | mesh_resource, | ||
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
const std_msgs::ColorRGBA & | color | ||
) |
Definition at line 213 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeMeshMarker | ( | const std::string & | name, |
const std::string & | mesh_resource, | ||
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
const std_msgs::ColorRGBA & | color, | ||
bool | use_color | ||
) |
Definition at line 180 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makePostureMarker | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale, | ||
bool | fixed, | ||
bool | view_facing | ||
) |
Definition at line 141 of file marker_helpers.cpp.
visualization_msgs::InteractiveMarker makeProjectorMarker | ( | const char * | name, |
const geometry_msgs::PoseStamped & | stamped, | ||
float | scale | ||
) |
Definition at line 301 of file marker_helpers.cpp.
visualization_msgs::Marker makeSphere | ( | visualization_msgs::InteractiveMarker & | msg, |
double | scale | ||
) |
Definition at line 97 of file marker_helpers.cpp.