Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020
00021
00022
00023
00024
00025
00026
00027
00028
00029
00030
00031
00032 #ifndef _MARKER_HELPERS_H_
00033 #define _MARKER_HELPERS_H_
00034
00035
00036 #include <interactive_markers/tools.h>
00037 #include <visualization_msgs/InteractiveMarker.h>
00038 #include <visualization_msgs/InteractiveMarkerControl.h>
00039 #include <visualization_msgs/Marker.h>
00040 #include <visualization_msgs/MenuEntry.h>
00041 #include <geometry_msgs/PoseStamped.h>
00042
00043
00044
00045 visualization_msgs::InteractiveMarker makeEmptyMarker( const char *frame_id = "" );
00046
00047 visualization_msgs::Marker makeBox( visualization_msgs::InteractiveMarker &msg );
00048
00049 void add6DofControl( visualization_msgs::InteractiveMarker &msg, bool fixed = false );
00050
00051 visualization_msgs::Marker makeSphere( visualization_msgs::InteractiveMarker &msg, double scale );
00052
00053
00054 visualization_msgs::InteractiveMarkerControl& makeBoxControl( visualization_msgs::InteractiveMarker &msg );
00055
00056 visualization_msgs::MenuEntry makeMenuEntry(const char *title);
00057
00058 visualization_msgs::MenuEntry makeMenuEntry(const char *title, const char *command, int type );
00059
00060 visualization_msgs::InteractiveMarker makePostureMarker( const char *name, const geometry_msgs::PoseStamped &stamped,
00061 float scale, bool fixed, bool view_facing );
00062
00063 visualization_msgs::InteractiveMarker makeHeadGoalMarker( const char *name, const geometry_msgs::PoseStamped &stamped,
00064 float scale);
00065
00066 visualization_msgs::InteractiveMarker makeMeshMarker( const std::string &name, const std::string &mesh_resource,
00067 const geometry_msgs::PoseStamped &stamped, float scale );
00068
00069 visualization_msgs::InteractiveMarker makeMeshMarker( const std::string &name, const std::string &mesh_resource,
00070 const geometry_msgs::PoseStamped &stamped, float scale, const std_msgs::ColorRGBA &color );
00071
00072 visualization_msgs::InteractiveMarker makeMeshMarker( const std::string &name, const std::string &mesh_resource,
00073 const geometry_msgs::PoseStamped &stamped, float scale, const std_msgs::ColorRGBA &color, bool use_color );
00074
00075 visualization_msgs::InteractiveMarker makeButtonBox( const char *name, const geometry_msgs::PoseStamped &stamped,
00076 float scale, bool fixed, bool view_facing );
00077
00078 visualization_msgs::InteractiveMarker make6DofMarker( const char *name, const geometry_msgs::PoseStamped &stamped,
00079 float scale, bool fixed, bool view_facing );
00080
00081 visualization_msgs::InteractiveMarker makeElevatorMarker( const char *name, const geometry_msgs::PoseStamped &stamped,
00082 float scale, bool fixed);
00083
00084 visualization_msgs::InteractiveMarker makeProjectorMarker( const char *name, const geometry_msgs::PoseStamped &stamped,
00085 float scale);
00086
00087
00088 visualization_msgs::InteractiveMarker makeBaseMarker( const char *name, const geometry_msgs::PoseStamped &stamped,
00089 float scale, bool fixed);
00090
00091 visualization_msgs::InteractiveMarker makeGripperMarker( const char *name, const geometry_msgs::PoseStamped &stamped,
00092 float scale, std_msgs::ColorRGBA color, float angle, bool view_facing );
00093
00094
00095 #endif