Marker.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/Marker.msg
3 // DO NOT EDIT!
4 
5 
6 #ifndef VISUALIZATION_MSGS_MESSAGE_MARKER_H
7 #define VISUALIZATION_MSGS_MESSAGE_MARKER_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>
21 #include <geometry_msgs/Vector3.h>
22 #include <std_msgs/ColorRGBA.h>
23 #include <geometry_msgs/Point.h>
24 #include <std_msgs/ColorRGBA.h>
25 
26 namespace visualization_msgs
27 {
28 template <class ContainerAllocator>
29 struct Marker_
30 {
32 
34  : header()
35  , ns()
36  , id(0)
37  , type(0)
38  , action(0)
39  , pose()
40  , scale()
41  , color()
42  , lifetime()
43  , frame_locked(false)
44  , points()
45  , colors()
46  , text()
47  , mesh_resource()
49  }
50  Marker_(const ContainerAllocator& _alloc)
51  : header(_alloc)
52  , ns(_alloc)
53  , id(0)
54  , type(0)
55  , action(0)
56  , pose(_alloc)
57  , scale(_alloc)
58  , color(_alloc)
59  , lifetime()
60  , frame_locked(false)
61  , points(_alloc)
62  , colors(_alloc)
63  , text(_alloc)
64  , mesh_resource(_alloc)
66  (void)_alloc;
67  }
68 
69 
70 
71  typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
73 
74  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _ns_type;
76 
77  typedef int32_t _id_type;
79 
80  typedef int32_t _type_type;
82 
83  typedef int32_t _action_type;
85 
86  typedef ::geometry_msgs::Pose_<ContainerAllocator> _pose_type;
88 
89  typedef ::geometry_msgs::Vector3_<ContainerAllocator> _scale_type;
91 
92  typedef ::std_msgs::ColorRGBA_<ContainerAllocator> _color_type;
94 
97 
98  typedef uint8_t _frame_locked_type;
100 
101  typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other > _points_type;
103 
104  typedef std::vector< ::std_msgs::ColorRGBA_<ContainerAllocator> , typename ContainerAllocator::template rebind< ::std_msgs::ColorRGBA_<ContainerAllocator> >::other > _colors_type;
106 
107  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _text_type;
109 
110  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _mesh_resource_type;
112 
115 
116 
117 
118 // reducing the odds to have name collisions with Windows.h
119 #if defined(_WIN32) && defined(ARROW)
120  #undef ARROW
121 #endif
122 #if defined(_WIN32) && defined(CUBE)
123  #undef CUBE
124 #endif
125 #if defined(_WIN32) && defined(SPHERE)
126  #undef SPHERE
127 #endif
128 #if defined(_WIN32) && defined(CYLINDER)
129  #undef CYLINDER
130 #endif
131 #if defined(_WIN32) && defined(LINE_STRIP)
132  #undef LINE_STRIP
133 #endif
134 #if defined(_WIN32) && defined(LINE_LIST)
135  #undef LINE_LIST
136 #endif
137 #if defined(_WIN32) && defined(CUBE_LIST)
138  #undef CUBE_LIST
139 #endif
140 #if defined(_WIN32) && defined(SPHERE_LIST)
141  #undef SPHERE_LIST
142 #endif
143 #if defined(_WIN32) && defined(POINTS)
144  #undef POINTS
145 #endif
146 #if defined(_WIN32) && defined(TEXT_VIEW_FACING)
147  #undef TEXT_VIEW_FACING
148 #endif
149 #if defined(_WIN32) && defined(MESH_RESOURCE)
150  #undef MESH_RESOURCE
151 #endif
152 #if defined(_WIN32) && defined(TRIANGLE_LIST)
153  #undef TRIANGLE_LIST
154 #endif
155 #if defined(_WIN32) && defined(ADD)
156  #undef ADD
157 #endif
158 #if defined(_WIN32) && defined(MODIFY)
159  #undef MODIFY
160 #endif
161 #if defined(_WIN32) && defined(DELETE)
162  #undef DELETE
163 #endif
164 #if defined(_WIN32) && defined(DELETEALL)
165  #undef DELETEALL
166 #endif
167 
168  enum {
169  ARROW = 0u,
170  CUBE = 1u,
171  SPHERE = 2u,
172  CYLINDER = 3u,
174  LINE_LIST = 5u,
175  CUBE_LIST = 6u,
177  POINTS = 8u,
181  ADD = 0u,
182  MODIFY = 0u,
183  DELETE = 2u,
184  DELETEALL = 3u,
185  };
186 
187 
188  typedef std::shared_ptr< ::visualization_msgs::Marker_<ContainerAllocator> > Ptr;
189  typedef std::shared_ptr< ::visualization_msgs::Marker_<ContainerAllocator> const> ConstPtr;
190 
191 }; // struct Marker_
192 
193 typedef ::visualization_msgs::Marker_<std::allocator<void> > Marker;
194 
195 typedef std::shared_ptr< ::visualization_msgs::Marker > MarkerPtr;
196 typedef std::shared_ptr< ::visualization_msgs::Marker const> MarkerConstPtr;
197 
198 // constants requiring out of line definition
199 
200 
201 
202 
203 
204 
205 
206 
207 
208 
209 
210 
211 
212 
213 
214 
215 
216 
217 
218 
219 
220 
221 
222 
223 
224 
225 
226 
227 
228 
229 
230 
231 
232 
233 
234 template<typename ContainerAllocator>
235 std::ostream& operator<<(std::ostream& s, const ::visualization_msgs::Marker_<ContainerAllocator> & v)
236 {
238 return s;
239 }
240 
241 
242 template<typename ContainerAllocator1, typename ContainerAllocator2>
243 bool operator==(const ::visualization_msgs::Marker_<ContainerAllocator1> & lhs, const ::visualization_msgs::Marker_<ContainerAllocator2> & rhs)
244 {
245  return lhs.header == rhs.header &&
246  lhs.ns == rhs.ns &&
247  lhs.id == rhs.id &&
248  lhs.type == rhs.type &&
249  lhs.action == rhs.action &&
250  lhs.pose == rhs.pose &&
251  lhs.scale == rhs.scale &&
252  lhs.color == rhs.color &&
253  lhs.lifetime == rhs.lifetime &&
254  lhs.frame_locked == rhs.frame_locked &&
255  lhs.points == rhs.points &&
256  lhs.colors == rhs.colors &&
257  lhs.text == rhs.text &&
258  lhs.mesh_resource == rhs.mesh_resource &&
259  lhs.mesh_use_embedded_materials == rhs.mesh_use_embedded_materials;
260 }
261 
262 template<typename ContainerAllocator1, typename ContainerAllocator2>
263 bool operator!=(const ::visualization_msgs::Marker_<ContainerAllocator1> & lhs, const ::visualization_msgs::Marker_<ContainerAllocator2> & rhs)
264 {
265  return !(lhs == rhs);
266 }
267 
268 
269 } // namespace visualization_msgs
270 
271 namespace roswrap
272 {
273 namespace message_traits
274 {
275 
276 
277 
278 
279 
280 template <class ContainerAllocator>
281 struct IsFixedSize< ::visualization_msgs::Marker_<ContainerAllocator> >
282  : FalseType
283  { };
284 
285 template <class ContainerAllocator>
286 struct IsFixedSize< ::visualization_msgs::Marker_<ContainerAllocator> const>
287  : FalseType
288  { };
289 
290 template <class ContainerAllocator>
291 struct IsMessage< ::visualization_msgs::Marker_<ContainerAllocator> >
292  : TrueType
293  { };
294 
295 template <class ContainerAllocator>
296 struct IsMessage< ::visualization_msgs::Marker_<ContainerAllocator> const>
297  : TrueType
298  { };
299 
300 template <class ContainerAllocator>
301 struct HasHeader< ::visualization_msgs::Marker_<ContainerAllocator> >
302  : TrueType
303  { };
304 
305 template <class ContainerAllocator>
306 struct HasHeader< ::visualization_msgs::Marker_<ContainerAllocator> const>
307  : TrueType
308  { };
309 
310 
311 template<class ContainerAllocator>
312 struct MD5Sum< ::visualization_msgs::Marker_<ContainerAllocator> >
313 {
314  static const char* value()
315  {
316  return "4048c9de2a16f4ae8e0538085ebf1b97";
317  }
318 
319  static const char* value(const ::visualization_msgs::Marker_<ContainerAllocator>&) { return value(); }
320  static const uint64_t static_value1 = 0x4048c9de2a16f4aeULL;
321  static const uint64_t static_value2 = 0x8e0538085ebf1b97ULL;
322 };
323 
324 template<class ContainerAllocator>
325 struct DataType< ::visualization_msgs::Marker_<ContainerAllocator> >
326 {
327  static const char* value()
328  {
329  return "visualization_msgs/Marker";
330  }
331 
332  static const char* value(const ::visualization_msgs::Marker_<ContainerAllocator>&) { return value(); }
333 };
334 
335 template<class ContainerAllocator>
336 struct Definition< ::visualization_msgs::Marker_<ContainerAllocator> >
337 {
338  static const char* value()
339  {
340  return "# 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"
341 "\n"
342 "uint8 ARROW=0\n"
343 "uint8 CUBE=1\n"
344 "uint8 SPHERE=2\n"
345 "uint8 CYLINDER=3\n"
346 "uint8 LINE_STRIP=4\n"
347 "uint8 LINE_LIST=5\n"
348 "uint8 CUBE_LIST=6\n"
349 "uint8 SPHERE_LIST=7\n"
350 "uint8 POINTS=8\n"
351 "uint8 TEXT_VIEW_FACING=9\n"
352 "uint8 MESH_RESOURCE=10\n"
353 "uint8 TRIANGLE_LIST=11\n"
354 "\n"
355 "uint8 ADD=0\n"
356 "uint8 MODIFY=0\n"
357 "uint8 DELETE=2\n"
358 "uint8 DELETEALL=3\n"
359 "\n"
360 "Header header # header for time/frame information\n"
361 "string ns # Namespace to place this object in... used in conjunction with id to create a unique name for the object\n"
362 "int32 id # object ID useful in conjunction with the namespace for manipulating and deleting the object later\n"
363 "int32 type # Type of object\n"
364 "int32 action # 0 add/modify an object, 1 (deprecated), 2 deletes an object, 3 deletes all objects\n"
365 "geometry_msgs/Pose pose # Pose of the object\n"
366 "geometry_msgs/Vector3 scale # Scale of the object 1,1,1 means default (usually 1 meter square)\n"
367 "std_msgs/ColorRGBA color # Color [0.0-1.0]\n"
368 "duration lifetime # How long the object should last before being automatically deleted. 0 means forever\n"
369 "bool frame_locked # If this marker should be frame-locked, i.e. retransformed into its frame every timestep\n"
370 "\n"
371 "#Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, ...)\n"
372 "geometry_msgs/Point[] points\n"
373 "#Only used if the type specified has some use for them (eg. POINTS, LINE_STRIP, ...)\n"
374 "#number of colors must either be 0 or equal to the number of points\n"
375 "#NOTE: alpha is not yet used\n"
376 "std_msgs/ColorRGBA[] colors\n"
377 "\n"
378 "# NOTE: only used for text markers\n"
379 "string text\n"
380 "\n"
381 "# NOTE: only used for MESH_RESOURCE markers\n"
382 "string mesh_resource\n"
383 "bool mesh_use_embedded_materials\n"
384 "\n"
385 "================================================================================\n"
386 "MSG: std_msgs/Header\n"
387 "# Standard metadata for higher-level stamped data types.\n"
388 "# This is generally used to communicate timestamped data \n"
389 "# in a particular coordinate frame.\n"
390 "# \n"
391 "# sequence ID: consecutively increasing ID \n"
392 "uint32 seq\n"
393 "#Two-integer timestamp that is expressed as:\n"
394 "# * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n"
395 "# * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n"
396 "# time-handling sugar is provided by the client library\n"
397 "time stamp\n"
398 "#Frame this data is associated with\n"
399 "string frame_id\n"
400 "\n"
401 "================================================================================\n"
402 "MSG: geometry_msgs/Pose\n"
403 "# A representation of pose in free space, composed of position and orientation. \n"
404 "Point position\n"
405 "Quaternion orientation\n"
406 "\n"
407 "================================================================================\n"
408 "MSG: geometry_msgs/Point\n"
409 "# This contains the position of a point in free space\n"
410 "float64 x\n"
411 "float64 y\n"
412 "float64 z\n"
413 "\n"
414 "================================================================================\n"
415 "MSG: geometry_msgs/Quaternion\n"
416 "# This represents an orientation in free space in quaternion form.\n"
417 "\n"
418 "float64 x\n"
419 "float64 y\n"
420 "float64 z\n"
421 "float64 w\n"
422 "\n"
423 "================================================================================\n"
424 "MSG: geometry_msgs/Vector3\n"
425 "# This represents a vector in free space. \n"
426 "# It is only meant to represent a direction. Therefore, it does not\n"
427 "# make sense to apply a translation to it (e.g., when applying a \n"
428 "# generic rigid transformation to a Vector3, tf2 will only apply the\n"
429 "# rotation). If you want your data to be translatable too, use the\n"
430 "# geometry_msgs/Point message instead.\n"
431 "\n"
432 "float64 x\n"
433 "float64 y\n"
434 "float64 z\n"
435 "================================================================================\n"
436 "MSG: std_msgs/ColorRGBA\n"
437 "float32 r\n"
438 "float32 g\n"
439 "float32 b\n"
440 "float32 a\n"
441 ;
442  }
443 
444  static const char* value(const ::visualization_msgs::Marker_<ContainerAllocator>&) { return value(); }
445 };
446 
447 } // namespace message_traits
448 } // namespace roswrap
449 
450 namespace roswrap
451 {
452 namespace serialization
453 {
454 
455  template<class ContainerAllocator> struct Serializer< ::visualization_msgs::Marker_<ContainerAllocator> >
456  {
457  template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
458  {
459  stream.next(m.header);
460  stream.next(m.ns);
461  stream.next(m.id);
462  stream.next(m.type);
463  stream.next(m.action);
464  stream.next(m.pose);
465  stream.next(m.scale);
466  stream.next(m.color);
467  stream.next(m.lifetime);
468  stream.next(m.frame_locked);
469  stream.next(m.points);
470  stream.next(m.colors);
471  stream.next(m.text);
472  stream.next(m.mesh_resource);
473  stream.next(m.mesh_use_embedded_materials);
474  }
475 
477  }; // struct Marker_
478 
479 } // namespace serialization
480 } // namespace roswrap
481 
482 namespace roswrap
483 {
484 namespace message_operations
485 {
486 
487 template<class ContainerAllocator>
488 struct Printer< ::visualization_msgs::Marker_<ContainerAllocator> >
489 {
490  template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::visualization_msgs::Marker_<ContainerAllocator>& v)
491  {
492  s << indent << "header: ";
493  s << std::endl;
495  s << indent << "ns: ";
496  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.ns);
497  s << indent << "id: ";
498  Printer<int32_t>::stream(s, indent + " ", v.id);
499  s << indent << "type: ";
500  Printer<int32_t>::stream(s, indent + " ", v.type);
501  s << indent << "action: ";
502  Printer<int32_t>::stream(s, indent + " ", v.action);
503  s << indent << "pose: ";
504  s << std::endl;
506  s << indent << "scale: ";
507  s << std::endl;
509  s << indent << "color: ";
510  s << std::endl;
512  s << indent << "lifetime: ";
513  Printer<ros::Duration>::stream(s, indent + " ", v.lifetime);
514  s << indent << "frame_locked: ";
515  Printer<uint8_t>::stream(s, indent + " ", v.frame_locked);
516  s << indent << "points[]" << std::endl;
517  for (size_t i = 0; i < v.points.size(); ++i)
518  {
519  s << indent << " points[" << i << "]: ";
520  s << std::endl;
521  s << indent;
523  }
524  s << indent << "colors[]" << std::endl;
525  for (size_t i = 0; i < v.colors.size(); ++i)
526  {
527  s << indent << " colors[" << i << "]: ";
528  s << std::endl;
529  s << indent;
531  }
532  s << indent << "text: ";
533  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.text);
534  s << indent << "mesh_resource: ";
535  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.mesh_resource);
536  s << indent << "mesh_use_embedded_materials: ";
537  Printer<uint8_t>::stream(s, indent + " ", v.mesh_use_embedded_materials);
538  }
539 };
540 
541 } // namespace message_operations
542 } // namespace roswrap
543 
544 #endif // VISUALIZATION_MSGS_MESSAGE_MARKER_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::operator!=
bool operator!=(const ::visualization_msgs::ImageMarker_< ContainerAllocator1 > &lhs, const ::visualization_msgs::ImageMarker_< ContainerAllocator2 > &rhs)
Definition: ImageMarker.h:197
visualization_msgs::Marker_::id
_id_type id
Definition: Marker.h:78
Point.h
multiscan_pcap_player.indent
indent
Definition: multiscan_pcap_player.py:252
std_msgs::ColorRGBA_
Definition: ColorRGBA.h:23
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
visualization_msgs::Marker_::header
_header_type header
Definition: Marker.h:72
const
#define const
Definition: getopt.c:38
visualization_msgs::Marker_::_id_type
int32_t _id_type
Definition: Marker.h:77
s
XmlRpcServer s
visualization_msgs::Marker_::CYLINDER
@ CYLINDER
Definition: Marker.h:172
Pose.h
visualization_msgs::Marker_::colors
_colors_type colors
Definition: Marker.h:105
roswrap::message_operations::Printer::stream
static void stream(Stream &s, const std::string &indent, const M &value)
Definition: message_operations.h:43
visualization_msgs::Marker_::_pose_type
::geometry_msgs::Pose_< ContainerAllocator > _pose_type
Definition: Marker.h:86
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
roswrap::message_operations::Printer< ::visualization_msgs::Marker_< ContainerAllocator > >::stream
static void stream(Stream &s, const std::string &indent, const ::visualization_msgs::Marker_< ContainerAllocator > &v)
Definition: Marker.h:490
geometry_msgs::Vector3_
Definition: kinetic/include/geometry_msgs/Vector3.h:23
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::Marker_::mesh_resource
_mesh_resource_type mesh_resource
Definition: Marker.h:111
visualization_msgs::Marker_::_type_type
int32_t _type_type
Definition: Marker.h:80
visualization_msgs::Marker_::_text_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _text_type
Definition: Marker.h:107
visualization_msgs::Marker_::ADD
@ ADD
Definition: Marker.h:181
visualization_msgs::operator==
bool operator==(const ::visualization_msgs::ImageMarker_< ContainerAllocator1 > &lhs, const ::visualization_msgs::ImageMarker_< ContainerAllocator2 > &rhs)
Definition: ImageMarker.h:179
visualization_msgs::Marker_::_colors_type
std::vector< ::std_msgs::ColorRGBA_< ContainerAllocator >, typename ContainerAllocator::template rebind< ::std_msgs::ColorRGBA_< ContainerAllocator > >::other > _colors_type
Definition: Marker.h:104
visualization_msgs::Marker_::SPHERE_LIST
@ SPHERE_LIST
Definition: Marker.h:176
visualization_msgs::Marker_
Definition: Marker.h:29
roswrap::message_traits::DataType
Specialize to provide the datatype for a message.
Definition: message_traits.h:135
visualization_msgs::Marker_::lifetime
_lifetime_type lifetime
Definition: Marker.h:96
visualization_msgs::Marker_::Marker_
Marker_(const ContainerAllocator &_alloc)
Definition: Marker.h:50
roswrap::message_traits::Definition
Specialize to provide the definition for a message.
Definition: message_traits.h:152
roswrap::message_traits::Definition< ::visualization_msgs::Marker_< ContainerAllocator > >::value
static const char * value()
Definition: Marker.h:338
visualization_msgs::operator<<
std::ostream & operator<<(std::ostream &s, const ::visualization_msgs::ImageMarker_< ContainerAllocator > &v)
Definition: ImageMarker.h:171
visualization_msgs::Marker_::DELETEALL
@ DELETEALL
Definition: Marker.h:184
roswrap::message_traits::MD5Sum< ::visualization_msgs::Marker_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::Marker_< ContainerAllocator > &)
Definition: Marker.h:319
geometry_msgs::Pose_
Definition: Pose.h:25
visualization_msgs::Marker_::pose
_pose_type pose
Definition: Marker.h:87
visualization_msgs::Marker_::_scale_type
::geometry_msgs::Vector3_< ContainerAllocator > _scale_type
Definition: Marker.h:89
visualization_msgs::Marker
::visualization_msgs::Marker_< std::allocator< void > > Marker
Definition: Marker.h:193
roswrap::message_traits::DataType< ::visualization_msgs::Marker_< ContainerAllocator > >::value
static const char * value()
Definition: Marker.h:327
visualization_msgs::Marker_::ConstPtr
std::shared_ptr< ::visualization_msgs::Marker_< ContainerAllocator > const > ConstPtr
Definition: Marker.h:189
visualization_msgs::Marker_::_points_type
std::vector< ::geometry_msgs::Point_< ContainerAllocator >, typename ContainerAllocator::template rebind< ::geometry_msgs::Point_< ContainerAllocator > >::other > _points_type
Definition: Marker.h:101
roswrap::message_traits::Definition< ::visualization_msgs::Marker_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::Marker_< ContainerAllocator > &)
Definition: Marker.h:444
visualization_msgs::Marker_::scale
_scale_type scale
Definition: Marker.h:90
roswrap
Definition: param_modi.cpp:41
visualization_msgs::Marker_::LINE_STRIP
@ LINE_STRIP
Definition: Marker.h:173
roswrap::message_operations::Printer
Definition: message_operations.h:40
std_msgs::Header_
Definition: Header.h:23
visualization_msgs::Marker_::color
_color_type color
Definition: Marker.h:93
ColorRGBA.h
visualization_msgs::Marker_::type
_type_type type
Definition: Marker.h:81
Vector3.h
visualization_msgs::Marker_::Type
Marker_< ContainerAllocator > Type
Definition: Marker.h:31
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::Marker_::TEXT_VIEW_FACING
@ TEXT_VIEW_FACING
Definition: Marker.h:178
visualization_msgs::Marker_::ARROW
@ ARROW
Definition: Marker.h:169
visualization_msgs
Definition: ImageMarker.h:26
roswrap::message_traits::DataType< ::visualization_msgs::Marker_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::Marker_< ContainerAllocator > &)
Definition: Marker.h:332
roswrap::serialization::Serializer< ::visualization_msgs::Marker_< ContainerAllocator > >::allInOne
static void allInOne(Stream &stream, T m)
Definition: Marker.h:457
visualization_msgs::Marker_::points
_points_type points
Definition: Marker.h:102
visualization_msgs::Marker_::_lifetime_type
ros::Duration _lifetime_type
Definition: Marker.h:95
visualization_msgs::Marker_::LINE_LIST
@ LINE_LIST
Definition: Marker.h:174
visualization_msgs::Marker_::frame_locked
_frame_locked_type frame_locked
Definition: Marker.h:99
roswrap::message_traits::IsMessage
Am I message or not.
Definition: message_traits.h:112
visualization_msgs::Marker_::mesh_use_embedded_materials
_mesh_use_embedded_materials_type mesh_use_embedded_materials
Definition: Marker.h:114
visualization_msgs::Marker_::Ptr
std::shared_ptr< ::visualization_msgs::Marker_< ContainerAllocator > > Ptr
Definition: Marker.h:188
roswrap::message_traits::MD5Sum< ::visualization_msgs::Marker_< ContainerAllocator > >::value
static const char * value()
Definition: Marker.h:314
visualization_msgs::Marker_::ns
_ns_type ns
Definition: Marker.h:75
visualization_msgs::Marker_::_action_type
int32_t _action_type
Definition: Marker.h:83
sick_scan_base.h
roswrap::serialization::Stream
Stream base-class, provides common functionality for IStream and OStream.
Definition: serialization.h:705
visualization_msgs::Marker_::CUBE_LIST
@ CUBE_LIST
Definition: Marker.h:175
visualization_msgs::Marker_::_color_type
::std_msgs::ColorRGBA_< ContainerAllocator > _color_type
Definition: Marker.h:92
visualization_msgs::Marker_::text
_text_type text
Definition: Marker.h:108
visualization_msgs::Marker_::MESH_RESOURCE
@ MESH_RESOURCE
Definition: Marker.h:179
visualization_msgs::Marker_::action
_action_type action
Definition: Marker.h:84
visualization_msgs::Marker_::_ns_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _ns_type
Definition: Marker.h:74
visualization_msgs::MarkerPtr
std::shared_ptr< ::visualization_msgs::Marker > MarkerPtr
Definition: Marker.h:195
visualization_msgs::Marker_::_mesh_resource_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _mesh_resource_type
Definition: Marker.h:110
visualization_msgs::Marker_::TRIANGLE_LIST
@ TRIANGLE_LIST
Definition: Marker.h:180
visualization_msgs::Marker_::_mesh_use_embedded_materials_type
uint8_t _mesh_use_embedded_materials_type
Definition: Marker.h:113
visualization_msgs::Marker_::CUBE
@ CUBE
Definition: Marker.h:170
visualization_msgs::Marker_::SPHERE
@ SPHERE
Definition: Marker.h:171
visualization_msgs::MarkerConstPtr
std::shared_ptr< ::visualization_msgs::Marker const > MarkerConstPtr
Definition: Marker.h:196
ros::Duration
Header.h
visualization_msgs::Marker_::MODIFY
@ MODIFY
Definition: Marker.h:182
visualization_msgs::Marker_::_header_type
::std_msgs::Header_< ContainerAllocator > _header_type
Definition: Marker.h:71
visualization_msgs::Marker_::DELETE
@ DELETE
Definition: Marker.h:183
visualization_msgs::Marker_::_frame_locked_type
uint8_t _frame_locked_type
Definition: Marker.h:98
visualization_msgs::Marker_::POINTS
@ POINTS
Definition: Marker.h:177
visualization_msgs::Marker_::Marker_
Marker_()
Definition: Marker.h:33


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