InteractiveMarker.h
Go to the documentation of this file.
1 #include "sick_scan/sick_scan_base.h" /* Base definitions included in all header files, added by add_sick_scan_base_header.py. Do not edit this line. */
2 // Generated by gencpp from file visualization_msgs/InteractiveMarker.msg
3 // DO NOT EDIT!
4 
5 
6 #ifndef VISUALIZATION_MSGS_MESSAGE_INTERACTIVEMARKER_H
7 #define VISUALIZATION_MSGS_MESSAGE_INTERACTIVEMARKER_H
8 
9 
10 #include <string>
11 #include <vector>
12 #include <map>
13 
14 #include <ros/types.h>
15 #include <ros/serialization.h>
16 #include <ros/builtin_message_traits.h>
17 #include <ros/message_operations.h>
18 
19 #include <std_msgs/Header.h>
20 #include <geometry_msgs/Pose.h>
23 
24 namespace visualization_msgs
25 {
26 template <class ContainerAllocator>
28 {
30 
32  : header()
33  , pose()
34  , name()
35  , description()
36  , scale(0.0)
37  , menu_entries()
38  , controls() {
39  }
40  InteractiveMarker_(const ContainerAllocator& _alloc)
41  : header(_alloc)
42  , pose(_alloc)
43  , name(_alloc)
44  , description(_alloc)
45  , scale(0.0)
46  , menu_entries(_alloc)
47  , controls(_alloc) {
48  (void)_alloc;
49  }
50 
51 
52 
53  typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
55 
56  typedef ::geometry_msgs::Pose_<ContainerAllocator> _pose_type;
58 
59  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _name_type;
61 
62  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _description_type;
64 
65  typedef float _scale_type;
67 
68  typedef std::vector< ::visualization_msgs::MenuEntry_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::visualization_msgs::MenuEntry_<ContainerAllocator> >::other > _menu_entries_type;
70 
71  typedef std::vector< ::visualization_msgs::InteractiveMarkerControl_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::visualization_msgs::InteractiveMarkerControl_<ContainerAllocator> >::other > _controls_type;
73 
74 
75 
76 
77 
78  typedef std::shared_ptr< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> > Ptr;
79  typedef std::shared_ptr< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> const> ConstPtr;
80 
81 }; // struct InteractiveMarker_
82 
83 typedef ::visualization_msgs::InteractiveMarker_<std::allocator<void> > InteractiveMarker;
84 
85 typedef std::shared_ptr< ::visualization_msgs::InteractiveMarker > InteractiveMarkerPtr;
86 typedef std::shared_ptr< ::visualization_msgs::InteractiveMarker const> InteractiveMarkerConstPtr;
87 
88 // constants requiring out of line definition
89 
90 
91 
92 template<typename ContainerAllocator>
93 std::ostream& operator<<(std::ostream& s, const ::visualization_msgs::InteractiveMarker_<ContainerAllocator> & v)
94 {
96 return s;
97 }
98 
99 
100 template<typename ContainerAllocator1, typename ContainerAllocator2>
101 bool operator==(const ::visualization_msgs::InteractiveMarker_<ContainerAllocator1> & lhs, const ::visualization_msgs::InteractiveMarker_<ContainerAllocator2> & rhs)
102 {
103  return lhs.header == rhs.header &&
104  lhs.pose == rhs.pose &&
105  lhs.name == rhs.name &&
106  lhs.description == rhs.description &&
107  lhs.scale == rhs.scale &&
108  lhs.menu_entries == rhs.menu_entries &&
109  lhs.controls == rhs.controls;
110 }
111 
112 template<typename ContainerAllocator1, typename ContainerAllocator2>
113 bool operator!=(const ::visualization_msgs::InteractiveMarker_<ContainerAllocator1> & lhs, const ::visualization_msgs::InteractiveMarker_<ContainerAllocator2> & rhs)
114 {
115  return !(lhs == rhs);
116 }
117 
118 
119 } // namespace visualization_msgs
120 
121 namespace roswrap
122 {
123 namespace message_traits
124 {
125 
126 
127 
128 
129 
130 template <class ContainerAllocator>
132  : FalseType
133  { };
134 
135 template <class ContainerAllocator>
137  : FalseType
138  { };
139 
140 template <class ContainerAllocator>
141 struct IsMessage< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> >
142  : TrueType
143  { };
144 
145 template <class ContainerAllocator>
147  : TrueType
148  { };
149 
150 template <class ContainerAllocator>
151 struct HasHeader< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> >
152  : TrueType
153  { };
154 
155 template <class ContainerAllocator>
157  : TrueType
158  { };
159 
160 
161 template<class ContainerAllocator>
162 struct MD5Sum< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> >
163 {
164  static const char* value()
165  {
166  return "dd86d22909d5a3364b384492e35c10af";
167  }
168 
169  static const char* value(const ::visualization_msgs::InteractiveMarker_<ContainerAllocator>&) { return value(); }
170  static const uint64_t static_value1 = 0xdd86d22909d5a336ULL;
171  static const uint64_t static_value2 = 0x4b384492e35c10afULL;
172 };
173 
174 template<class ContainerAllocator>
175 struct DataType< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> >
176 {
177  static const char* value()
178  {
179  return "visualization_msgs/InteractiveMarker";
180  }
181 
182  static const char* value(const ::visualization_msgs::InteractiveMarker_<ContainerAllocator>&) { return value(); }
183 };
184 
185 template<class ContainerAllocator>
186 struct Definition< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> >
187 {
188  static const char* value()
189  {
190  return "# Time/frame info.\n"
191 "# If header.time is set to 0, the marker will be retransformed into\n"
192 "# its frame on each timestep. You will receive the pose feedback\n"
193 "# in the same frame.\n"
194 "# Otherwise, you might receive feedback in a different frame.\n"
195 "# For rviz, this will be the current 'fixed frame' set by the user.\n"
196 "Header header\n"
197 "\n"
198 "# Initial pose. Also, defines the pivot point for rotations.\n"
199 "geometry_msgs/Pose pose\n"
200 "\n"
201 "# Identifying string. Must be globally unique in\n"
202 "# the topic that this message is sent through.\n"
203 "string name\n"
204 "\n"
205 "# Short description (< 40 characters).\n"
206 "string description\n"
207 "\n"
208 "# Scale to be used for default controls (default=1).\n"
209 "float32 scale\n"
210 "\n"
211 "# All menu and submenu entries associated with this marker.\n"
212 "MenuEntry[] menu_entries\n"
213 "\n"
214 "# List of controls displayed for this marker.\n"
215 "InteractiveMarkerControl[] controls\n"
216 "\n"
217 "================================================================================\n"
218 "MSG: std_msgs/Header\n"
219 "# Standard metadata for higher-level stamped data types.\n"
220 "# This is generally used to communicate timestamped data \n"
221 "# in a particular coordinate frame.\n"
222 "# \n"
223 "# sequence ID: consecutively increasing ID \n"
224 "uint32 seq\n"
225 "#Two-integer timestamp that is expressed as:\n"
226 "# * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n"
227 "# * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n"
228 "# time-handling sugar is provided by the client library\n"
229 "time stamp\n"
230 "#Frame this data is associated with\n"
231 "string frame_id\n"
232 "\n"
233 "================================================================================\n"
234 "MSG: geometry_msgs/Pose\n"
235 "# A representation of pose in free space, composed of position and orientation. \n"
236 "Point position\n"
237 "Quaternion orientation\n"
238 "\n"
239 "================================================================================\n"
240 "MSG: geometry_msgs/Point\n"
241 "# This contains the position of a point in free space\n"
242 "float64 x\n"
243 "float64 y\n"
244 "float64 z\n"
245 "\n"
246 "================================================================================\n"
247 "MSG: geometry_msgs/Quaternion\n"
248 "# This represents an orientation in free space in quaternion form.\n"
249 "\n"
250 "float64 x\n"
251 "float64 y\n"
252 "float64 z\n"
253 "float64 w\n"
254 "\n"
255 "================================================================================\n"
256 "MSG: visualization_msgs/MenuEntry\n"
257 "# MenuEntry message.\n"
258 "\n"
259 "# Each InteractiveMarker message has an array of MenuEntry messages.\n"
260 "# A collection of MenuEntries together describe a\n"
261 "# menu/submenu/subsubmenu/etc tree, though they are stored in a flat\n"
262 "# array. The tree structure is represented by giving each menu entry\n"
263 "# an ID number and a \"parent_id\" field. Top-level entries are the\n"
264 "# ones with parent_id = 0. Menu entries are ordered within their\n"
265 "# level the same way they are ordered in the containing array. Parent\n"
266 "# entries must appear before their children.\n"
267 "\n"
268 "# Example:\n"
269 "# - id = 3\n"
270 "# parent_id = 0\n"
271 "# title = \"fun\"\n"
272 "# - id = 2\n"
273 "# parent_id = 0\n"
274 "# title = \"robot\"\n"
275 "# - id = 4\n"
276 "# parent_id = 2\n"
277 "# title = \"pr2\"\n"
278 "# - id = 5\n"
279 "# parent_id = 2\n"
280 "# title = \"turtle\"\n"
281 "#\n"
282 "# Gives a menu tree like this:\n"
283 "# - fun\n"
284 "# - robot\n"
285 "# - pr2\n"
286 "# - turtle\n"
287 "\n"
288 "# ID is a number for each menu entry. Must be unique within the\n"
289 "# control, and should never be 0.\n"
290 "uint32 id\n"
291 "\n"
292 "# ID of the parent of this menu entry, if it is a submenu. If this\n"
293 "# menu entry is a top-level entry, set parent_id to 0.\n"
294 "uint32 parent_id\n"
295 "\n"
296 "# menu / entry title\n"
297 "string title\n"
298 "\n"
299 "# Arguments to command indicated by command_type (below)\n"
300 "string command\n"
301 "\n"
302 "# Command_type stores the type of response desired when this menu\n"
303 "# entry is clicked.\n"
304 "# FEEDBACK: send an InteractiveMarkerFeedback message with menu_entry_id set to this entry's id.\n"
305 "# ROSRUN: execute \"rosrun\" with arguments given in the command field (above).\n"
306 "# ROSLAUNCH: execute \"roslaunch\" with arguments given in the command field (above).\n"
307 "uint8 FEEDBACK=0\n"
308 "uint8 ROSRUN=1\n"
309 "uint8 ROSLAUNCH=2\n"
310 "uint8 command_type\n"
311 "\n"
312 "================================================================================\n"
313 "MSG: visualization_msgs/InteractiveMarkerControl\n"
314 "# Represents a control that is to be displayed together with an interactive marker\n"
315 "\n"
316 "# Identifying string for this control.\n"
317 "# You need to assign a unique value to this to receive feedback from the GUI\n"
318 "# on what actions the user performs on this control (e.g. a button click).\n"
319 "string name\n"
320 "\n"
321 "\n"
322 "# Defines the local coordinate frame (relative to the pose of the parent\n"
323 "# interactive marker) in which is being rotated and translated.\n"
324 "# Default: Identity\n"
325 "geometry_msgs/Quaternion orientation\n"
326 "\n"
327 "\n"
328 "# Orientation mode: controls how orientation changes.\n"
329 "# INHERIT: Follow orientation of interactive marker\n"
330 "# FIXED: Keep orientation fixed at initial state\n"
331 "# VIEW_FACING: Align y-z plane with screen (x: forward, y:left, z:up).\n"
332 "uint8 INHERIT = 0 \n"
333 "uint8 FIXED = 1\n"
334 "uint8 VIEW_FACING = 2\n"
335 "\n"
336 "uint8 orientation_mode\n"
337 "\n"
338 "# Interaction mode for this control\n"
339 "# \n"
340 "# NONE: This control is only meant for visualization; no context menu.\n"
341 "# MENU: Like NONE, but right-click menu is active.\n"
342 "# BUTTON: Element can be left-clicked.\n"
343 "# MOVE_AXIS: Translate along local x-axis.\n"
344 "# MOVE_PLANE: Translate in local y-z plane.\n"
345 "# ROTATE_AXIS: Rotate around local x-axis.\n"
346 "# MOVE_ROTATE: Combines MOVE_PLANE and ROTATE_AXIS.\n"
347 "uint8 NONE = 0 \n"
348 "uint8 MENU = 1\n"
349 "uint8 BUTTON = 2\n"
350 "uint8 MOVE_AXIS = 3 \n"
351 "uint8 MOVE_PLANE = 4\n"
352 "uint8 ROTATE_AXIS = 5\n"
353 "uint8 MOVE_ROTATE = 6\n"
354 "# \"3D\" interaction modes work with the mouse+SHIFT+CTRL or with 3D cursors.\n"
355 "# MOVE_3D: Translate freely in 3D space.\n"
356 "# ROTATE_3D: Rotate freely in 3D space about the origin of parent frame.\n"
357 "# MOVE_ROTATE_3D: Full 6-DOF freedom of translation and rotation about the cursor origin.\n"
358 "uint8 MOVE_3D = 7\n"
359 "uint8 ROTATE_3D = 8\n"
360 "uint8 MOVE_ROTATE_3D = 9\n"
361 "\n"
362 "uint8 interaction_mode\n"
363 "\n"
364 "\n"
365 "# If true, the contained markers will also be visible\n"
366 "# when the gui is not in interactive mode.\n"
367 "bool always_visible\n"
368 "\n"
369 "\n"
370 "# Markers to be displayed as custom visual representation.\n"
371 "# Leave this empty to use the default control handles.\n"
372 "#\n"
373 "# Note: \n"
374 "# - The markers can be defined in an arbitrary coordinate frame,\n"
375 "# but will be transformed into the local frame of the interactive marker.\n"
376 "# - If the header of a marker is empty, its pose will be interpreted as \n"
377 "# relative to the pose of the parent interactive marker.\n"
378 "Marker[] markers\n"
379 "\n"
380 "\n"
381 "# In VIEW_FACING mode, set this to true if you don't want the markers\n"
382 "# to be aligned with the camera view point. The markers will show up\n"
383 "# as in INHERIT mode.\n"
384 "bool independent_marker_orientation\n"
385 "\n"
386 "\n"
387 "# Short description (< 40 characters) of what this control does,\n"
388 "# e.g. \"Move the robot\". \n"
389 "# Default: A generic description based on the interaction mode\n"
390 "string description\n"
391 "\n"
392 "================================================================================\n"
393 "MSG: visualization_msgs/Marker\n"
394 "# See http://www.ros.org/wiki/rviz/DisplayTypes/Marker and http://www.ros.org/wiki/rviz/Tutorials/Markers%3A%20Basic%20Shapes for more information on using this message with rviz\n"
395 "\n"
396 "uint8 ARROW=0\n"
397 "uint8 CUBE=1\n"
398 "uint8 SPHERE=2\n"
399 "uint8 CYLINDER=3\n"
400 "uint8 LINE_STRIP=4\n"
401 "uint8 LINE_LIST=5\n"
402 "uint8 CUBE_LIST=6\n"
403 "uint8 SPHERE_LIST=7\n"
404 "uint8 POINTS=8\n"
405 "uint8 TEXT_VIEW_FACING=9\n"
406 "uint8 MESH_RESOURCE=10\n"
407 "uint8 TRIANGLE_LIST=11\n"
408 "\n"
409 "uint8 ADD=0\n"
410 "uint8 MODIFY=0\n"
411 "uint8 DELETE=2\n"
412 "uint8 DELETEALL=3\n"
413 "\n"
414 "Header header # header for time/frame information\n"
415 "string ns # Namespace to place this object in... used in conjunction with id to create a unique name for the object\n"
416 "int32 id # object ID useful in conjunction with the namespace for manipulating and deleting the object later\n"
417 "int32 type # Type of object\n"
418 "int32 action # 0 add/modify an object, 1 (deprecated), 2 deletes an object, 3 deletes all objects\n"
419 "geometry_msgs/Pose pose # Pose of the object\n"
420 "geometry_msgs/Vector3 scale # Scale of the object 1,1,1 means default (usually 1 meter square)\n"
421 "std_msgs/ColorRGBA color # Color [0.0-1.0]\n"
422 "duration lifetime # How long the object should last before being automatically deleted. 0 means forever\n"
423 "bool frame_locked # If this marker should be frame-locked, i.e. retransformed into its frame every timestep\n"
424 "\n"
425 "#Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, ...)\n"
426 "geometry_msgs/Point[] points\n"
427 "#Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, ...)\n"
428 "#number of colors must either be 0 or equal to the number of points\n"
429 "#NOTE: alpha is not yet used\n"
430 "std_msgs/ColorRGBA[] colors\n"
431 "\n"
432 "# NOTE: only used for text markers\n"
433 "string text\n"
434 "\n"
435 "# NOTE: only used for MESH_RESOURCE markers\n"
436 "string mesh_resource\n"
437 "bool mesh_use_embedded_materials\n"
438 "\n"
439 "================================================================================\n"
440 "MSG: geometry_msgs/Vector3\n"
441 "# This represents a vector in free space. \n"
442 "# It is only meant to represent a direction. Therefore, it does not\n"
443 "# make sense to apply a translation to it (e.g., when applying a \n"
444 "# generic rigid transformation to a Vector3, tf2 will only apply the\n"
445 "# rotation). If you want your data to be translatable too, use the\n"
446 "# geometry_msgs/Point message instead.\n"
447 "\n"
448 "float64 x\n"
449 "float64 y\n"
450 "float64 z\n"
451 "================================================================================\n"
452 "MSG: std_msgs/ColorRGBA\n"
453 "float32 r\n"
454 "float32 g\n"
455 "float32 b\n"
456 "float32 a\n"
457 ;
458  }
459 
460  static const char* value(const ::visualization_msgs::InteractiveMarker_<ContainerAllocator>&) { return value(); }
461 };
462 
463 } // namespace message_traits
464 } // namespace roswrap
465 
466 namespace roswrap
467 {
468 namespace serialization
469 {
470 
471  template<class ContainerAllocator> struct Serializer< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> >
472  {
473  template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
474  {
475  stream.next(m.header);
476  stream.next(m.pose);
477  stream.next(m.name);
478  stream.next(m.description);
479  stream.next(m.scale);
480  stream.next(m.menu_entries);
481  stream.next(m.controls);
482  }
483 
485  }; // struct InteractiveMarker_
486 
487 } // namespace serialization
488 } // namespace roswrap
489 
490 namespace roswrap
491 {
492 namespace message_operations
493 {
494 
495 template<class ContainerAllocator>
496 struct Printer< ::visualization_msgs::InteractiveMarker_<ContainerAllocator> >
497 {
498  template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::visualization_msgs::InteractiveMarker_<ContainerAllocator>& v)
499  {
500  s << indent << "header: ";
501  s << std::endl;
503  s << indent << "pose: ";
504  s << std::endl;
506  s << indent << "name: ";
507  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.name);
508  s << indent << "description: ";
509  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.description);
510  s << indent << "scale: ";
511  Printer<float>::stream(s, indent + " ", v.scale);
512  s << indent << "menu_entries[]" << std::endl;
513  for (size_t i = 0; i < v.menu_entries.size(); ++i)
514  {
515  s << indent << " menu_entries[" << i << "]: ";
516  s << std::endl;
517  s << indent;
519  }
520  s << indent << "controls[]" << std::endl;
521  for (size_t i = 0; i < v.controls.size(); ++i)
522  {
523  s << indent << " controls[" << i << "]: ";
524  s << std::endl;
525  s << indent;
527  }
528  }
529 };
530 
531 } // namespace message_operations
532 } // namespace roswrap
533 
534 #endif // VISUALIZATION_MSGS_MESSAGE_INTERACTIVEMARKER_H
roswrap::message_traits::FalseType
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Definition: message_traits.h:89
visualization_msgs::InteractiveMarker_::_name_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _name_type
Definition: InteractiveMarker.h:59
visualization_msgs::operator!=
bool operator!=(const ::visualization_msgs::ImageMarker_< ContainerAllocator1 > &lhs, const ::visualization_msgs::ImageMarker_< ContainerAllocator2 > &rhs)
Definition: ImageMarker.h:197
multiscan_pcap_player.indent
indent
Definition: multiscan_pcap_player.py:252
visualization_msgs::InteractiveMarker_::InteractiveMarker_
InteractiveMarker_(const ContainerAllocator &_alloc)
Definition: InteractiveMarker.h:40
roswrap::serialization::Serializer
Templated serialization class. Default implementation provides backwards compatibility with old messa...
Definition: serialization.h:120
roswrap::message_traits::HasHeader
HasHeader informs whether or not there is a header that gets serialized as the first thing in the mes...
Definition: message_traits.h:107
const
#define const
Definition: getopt.c:38
s
XmlRpcServer s
visualization_msgs::InteractiveMarker_::Type
InteractiveMarker_< ContainerAllocator > Type
Definition: InteractiveMarker.h:29
visualization_msgs::InteractiveMarker_::scale
_scale_type scale
Definition: InteractiveMarker.h:66
Pose.h
MenuEntry.h
visualization_msgs::InteractiveMarkerConstPtr
std::shared_ptr< ::visualization_msgs::InteractiveMarker const > InteractiveMarkerConstPtr
Definition: InteractiveMarker.h:86
visualization_msgs::InteractiveMarker_::_pose_type
::geometry_msgs::Pose_< ContainerAllocator > _pose_type
Definition: InteractiveMarker.h:56
visualization_msgs::InteractiveMarker_
Definition: InteractiveMarker.h:27
visualization_msgs::InteractiveMarker_::menu_entries
_menu_entries_type menu_entries
Definition: InteractiveMarker.h:69
roswrap::message_traits::MD5Sum< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::value
static const char * value()
Definition: InteractiveMarker.h:164
roswrap::message_operations::Printer::stream
static void stream(Stream &s, const std::string &indent, const M &value)
Definition: message_operations.h:43
roswrap::message_traits::Definition< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::InteractiveMarker_< ContainerAllocator > &)
Definition: InteractiveMarker.h:460
roswrap::message_traits::IsFixedSize
A fixed-size datatype is one whose size is constant, i.e. it has no variable-length arrays or strings...
Definition: message_traits.h:103
ros::message_operations::Printer
ROS_DECLARE_ALLINONE_SERIALIZER
#define ROS_DECLARE_ALLINONE_SERIALIZER
Declare your serializer to use an allInOne member instead of requiring 3 different serialization func...
Definition: serialization.h:74
visualization_msgs::InteractiveMarker_::_header_type
::std_msgs::Header_< ContainerAllocator > _header_type
Definition: InteractiveMarker.h:53
visualization_msgs::operator==
bool operator==(const ::visualization_msgs::ImageMarker_< ContainerAllocator1 > &lhs, const ::visualization_msgs::ImageMarker_< ContainerAllocator2 > &rhs)
Definition: ImageMarker.h:179
roswrap::message_traits::Definition< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::value
static const char * value()
Definition: InteractiveMarker.h:188
roswrap::message_operations::Printer< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::stream
static void stream(Stream &s, const std::string &indent, const ::visualization_msgs::InteractiveMarker_< ContainerAllocator > &v)
Definition: InteractiveMarker.h:498
roswrap::message_traits::DataType
Specialize to provide the datatype for a message.
Definition: message_traits.h:135
visualization_msgs::InteractiveMarker_::description
_description_type description
Definition: InteractiveMarker.h:63
roswrap::message_traits::Definition
Specialize to provide the definition for a message.
Definition: message_traits.h:152
visualization_msgs::InteractiveMarker_::_description_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _description_type
Definition: InteractiveMarker.h:62
visualization_msgs::operator<<
std::ostream & operator<<(std::ostream &s, const ::visualization_msgs::ImageMarker_< ContainerAllocator > &v)
Definition: ImageMarker.h:171
InteractiveMarkerControl.h
visualization_msgs::InteractiveMarker_::InteractiveMarker_
InteractiveMarker_()
Definition: InteractiveMarker.h:31
roswrap::message_traits::DataType< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::value
static const char * value()
Definition: InteractiveMarker.h:177
geometry_msgs::Pose_< std::allocator< void > >
visualization_msgs::InteractiveMarker_::ConstPtr
std::shared_ptr< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > const > ConstPtr
Definition: InteractiveMarker.h:79
visualization_msgs::InteractiveMarker
::visualization_msgs::InteractiveMarker_< std::allocator< void > > InteractiveMarker
Definition: InteractiveMarker.h:83
roswrap
Definition: param_modi.cpp:41
visualization_msgs::InteractiveMarker_::_controls_type
std::vector< ::visualization_msgs::InteractiveMarkerControl_< ContainerAllocator >, typename ContainerAllocator::template rebind< ::visualization_msgs::InteractiveMarkerControl_< ContainerAllocator > >::other > _controls_type
Definition: InteractiveMarker.h:71
visualization_msgs::InteractiveMarker_::_scale_type
float _scale_type
Definition: InteractiveMarker.h:65
roswrap::message_operations::Printer
Definition: message_operations.h:40
std_msgs::Header_< std::allocator< void > >
visualization_msgs::InteractiveMarker_::pose
_pose_type pose
Definition: InteractiveMarker.h:57
roswrap::message_traits::DataType< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::InteractiveMarker_< ContainerAllocator > &)
Definition: InteractiveMarker.h:182
roswrap::message_traits::TrueType
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Definition: message_traits.h:79
roswrap::message_traits::MD5Sum
Specialize to provide the md5sum for a message.
Definition: message_traits.h:118
visualization_msgs
Definition: ImageMarker.h:26
roswrap::serialization::Serializer< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::allInOne
static void allInOne(Stream &stream, T m)
Definition: InteractiveMarker.h:473
roswrap::message_traits::IsMessage
Am I message or not.
Definition: message_traits.h:112
visualization_msgs::InteractiveMarker_::header
_header_type header
Definition: InteractiveMarker.h:54
visualization_msgs::InteractiveMarkerPtr
std::shared_ptr< ::visualization_msgs::InteractiveMarker > InteractiveMarkerPtr
Definition: InteractiveMarker.h:85
visualization_msgs::InteractiveMarker_::_menu_entries_type
std::vector< ::visualization_msgs::MenuEntry_< ContainerAllocator >, typename ContainerAllocator::template rebind< ::visualization_msgs::MenuEntry_< ContainerAllocator > >::other > _menu_entries_type
Definition: InteractiveMarker.h:68
sick_scan_base.h
roswrap::serialization::Stream
Stream base-class, provides common functionality for IStream and OStream.
Definition: serialization.h:705
visualization_msgs::InteractiveMarker_::controls
_controls_type controls
Definition: InteractiveMarker.h:72
roswrap::message_traits::MD5Sum< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::InteractiveMarker_< ContainerAllocator > &)
Definition: InteractiveMarker.h:169
visualization_msgs::InteractiveMarker_::name
_name_type name
Definition: InteractiveMarker.h:60
visualization_msgs::InteractiveMarker_::Ptr
std::shared_ptr< ::visualization_msgs::InteractiveMarker_< ContainerAllocator > > Ptr
Definition: InteractiveMarker.h:78
Header.h


sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:08