InteractiveMarkerFeedback.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/InteractiveMarkerFeedback.msg
3 // DO NOT EDIT!
4 
5 
6 #ifndef VISUALIZATION_MSGS_MESSAGE_INTERACTIVEMARKERFEEDBACK_H
7 #define VISUALIZATION_MSGS_MESSAGE_INTERACTIVEMARKERFEEDBACK_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/Point.h>
22 
23 namespace visualization_msgs
24 {
25 template <class ContainerAllocator>
27 {
29 
31  : header()
32  , client_id()
33  , marker_name()
34  , control_name()
35  , event_type(0)
36  , pose()
37  , menu_entry_id(0)
38  , mouse_point()
39  , mouse_point_valid(false) {
40  }
41  InteractiveMarkerFeedback_(const ContainerAllocator& _alloc)
42  : header(_alloc)
43  , client_id(_alloc)
44  , marker_name(_alloc)
45  , control_name(_alloc)
46  , event_type(0)
47  , pose(_alloc)
48  , menu_entry_id(0)
49  , mouse_point(_alloc)
50  , mouse_point_valid(false) {
51  (void)_alloc;
52  }
53 
54 
55 
56  typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
58 
59  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _client_id_type;
61 
62  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _marker_name_type;
64 
65  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _control_name_type;
67 
68  typedef uint8_t _event_type_type;
70 
71  typedef ::geometry_msgs::Pose_<ContainerAllocator> _pose_type;
73 
74  typedef uint32_t _menu_entry_id_type;
76 
77  typedef ::geometry_msgs::Point_<ContainerAllocator> _mouse_point_type;
79 
80  typedef uint8_t _mouse_point_valid_type;
82 
83 
84 
85 // reducing the odds to have name collisions with Windows.h
86 #if defined(_WIN32) && defined(KEEP_ALIVE)
87  #undef KEEP_ALIVE
88 #endif
89 #if defined(_WIN32) && defined(POSE_UPDATE)
90  #undef POSE_UPDATE
91 #endif
92 #if defined(_WIN32) && defined(MENU_SELECT)
93  #undef MENU_SELECT
94 #endif
95 #if defined(_WIN32) && defined(BUTTON_CLICK)
96  #undef BUTTON_CLICK
97 #endif
98 #if defined(_WIN32) && defined(MOUSE_DOWN)
99  #undef MOUSE_DOWN
100 #endif
101 #if defined(_WIN32) && defined(MOUSE_UP)
102  #undef MOUSE_UP
103 #endif
104 
105  enum {
111  MOUSE_UP = 5u,
112  };
113 
114 
115  typedef std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator> > Ptr;
116  typedef std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator> const> ConstPtr;
117 
118 }; // struct InteractiveMarkerFeedback_
119 
120 typedef ::visualization_msgs::InteractiveMarkerFeedback_<std::allocator<void> > InteractiveMarkerFeedback;
121 
122 typedef std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback > InteractiveMarkerFeedbackPtr;
123 typedef std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback const> InteractiveMarkerFeedbackConstPtr;
124 
125 // constants requiring out of line definition
126 
127 
128 
129 
130 
131 
132 
133 
134 
135 
136 
137 
138 
139 
140 
141 template<typename ContainerAllocator>
142 std::ostream& operator<<(std::ostream& s, const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator> & v)
143 {
145 return s;
146 }
147 
148 
149 template<typename ContainerAllocator1, typename ContainerAllocator2>
150 bool operator==(const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator1> & lhs, const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator2> & rhs)
151 {
152  return lhs.header == rhs.header &&
153  lhs.client_id == rhs.client_id &&
154  lhs.marker_name == rhs.marker_name &&
155  lhs.control_name == rhs.control_name &&
156  lhs.event_type == rhs.event_type &&
157  lhs.pose == rhs.pose &&
158  lhs.menu_entry_id == rhs.menu_entry_id &&
159  lhs.mouse_point == rhs.mouse_point &&
160  lhs.mouse_point_valid == rhs.mouse_point_valid;
161 }
162 
163 template<typename ContainerAllocator1, typename ContainerAllocator2>
164 bool operator!=(const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator1> & lhs, const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator2> & rhs)
165 {
166  return !(lhs == rhs);
167 }
168 
169 
170 } // namespace visualization_msgs
171 
172 namespace roswrap
173 {
174 namespace message_traits
175 {
176 
177 
178 
179 
180 
181 template <class ContainerAllocator>
183  : FalseType
184  { };
185 
186 template <class ContainerAllocator>
188  : FalseType
189  { };
190 
191 template <class ContainerAllocator>
193  : TrueType
194  { };
195 
196 template <class ContainerAllocator>
198  : TrueType
199  { };
200 
201 template <class ContainerAllocator>
203  : TrueType
204  { };
205 
206 template <class ContainerAllocator>
208  : TrueType
209  { };
210 
211 
212 template<class ContainerAllocator>
214 {
215  static const char* value()
216  {
217  return "ab0f1eee058667e28c19ff3ffc3f4b78";
218  }
219 
220  static const char* value(const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator>&) { return value(); }
221  static const uint64_t static_value1 = 0xab0f1eee058667e2ULL;
222  static const uint64_t static_value2 = 0x8c19ff3ffc3f4b78ULL;
223 };
224 
225 template<class ContainerAllocator>
227 {
228  static const char* value()
229  {
230  return "visualization_msgs/InteractiveMarkerFeedback";
231  }
232 
233  static const char* value(const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator>&) { return value(); }
234 };
235 
236 template<class ContainerAllocator>
238 {
239  static const char* value()
240  {
241  return "# Time/frame info.\n"
242 "Header header\n"
243 "\n"
244 "# Identifying string. Must be unique in the topic namespace.\n"
245 "string client_id\n"
246 "\n"
247 "# Feedback message sent back from the GUI, e.g.\n"
248 "# when the status of an interactive marker was modified by the user.\n"
249 "\n"
250 "# Specifies which interactive marker and control this message refers to\n"
251 "string marker_name\n"
252 "string control_name\n"
253 "\n"
254 "# Type of the event\n"
255 "# KEEP_ALIVE: sent while dragging to keep up control of the marker\n"
256 "# MENU_SELECT: a menu entry has been selected\n"
257 "# BUTTON_CLICK: a button control has been clicked\n"
258 "# POSE_UPDATE: the pose has been changed using one of the controls\n"
259 "uint8 KEEP_ALIVE = 0\n"
260 "uint8 POSE_UPDATE = 1\n"
261 "uint8 MENU_SELECT = 2\n"
262 "uint8 BUTTON_CLICK = 3\n"
263 "\n"
264 "uint8 MOUSE_DOWN = 4\n"
265 "uint8 MOUSE_UP = 5\n"
266 "\n"
267 "uint8 event_type\n"
268 "\n"
269 "# Current pose of the marker\n"
270 "# Note: Has to be valid for all feedback types.\n"
271 "geometry_msgs/Pose pose\n"
272 "\n"
273 "# Contains the ID of the selected menu entry\n"
274 "# Only valid for MENU_SELECT events.\n"
275 "uint32 menu_entry_id\n"
276 "\n"
277 "# If event_type is BUTTON_CLICK, MOUSE_DOWN, or MOUSE_UP, mouse_point\n"
278 "# may contain the 3 dimensional position of the event on the\n"
279 "# control. If it does, mouse_point_valid will be true. mouse_point\n"
280 "# will be relative to the frame listed in the header.\n"
281 "geometry_msgs/Point mouse_point\n"
282 "bool mouse_point_valid\n"
283 "\n"
284 "================================================================================\n"
285 "MSG: std_msgs/Header\n"
286 "# Standard metadata for higher-level stamped data types.\n"
287 "# This is generally used to communicate timestamped data \n"
288 "# in a particular coordinate frame.\n"
289 "# \n"
290 "# sequence ID: consecutively increasing ID \n"
291 "uint32 seq\n"
292 "#Two-integer timestamp that is expressed as:\n"
293 "# * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n"
294 "# * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n"
295 "# time-handling sugar is provided by the client library\n"
296 "time stamp\n"
297 "#Frame this data is associated with\n"
298 "string frame_id\n"
299 "\n"
300 "================================================================================\n"
301 "MSG: geometry_msgs/Pose\n"
302 "# A representation of pose in free space, composed of position and orientation. \n"
303 "Point position\n"
304 "Quaternion orientation\n"
305 "\n"
306 "================================================================================\n"
307 "MSG: geometry_msgs/Point\n"
308 "# This contains the position of a point in free space\n"
309 "float64 x\n"
310 "float64 y\n"
311 "float64 z\n"
312 "\n"
313 "================================================================================\n"
314 "MSG: geometry_msgs/Quaternion\n"
315 "# This represents an orientation in free space in quaternion form.\n"
316 "\n"
317 "float64 x\n"
318 "float64 y\n"
319 "float64 z\n"
320 "float64 w\n"
321 ;
322  }
323 
324  static const char* value(const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator>&) { return value(); }
325 };
326 
327 } // namespace message_traits
328 } // namespace roswrap
329 
330 namespace roswrap
331 {
332 namespace serialization
333 {
334 
335  template<class ContainerAllocator> struct Serializer< ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator> >
336  {
337  template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
338  {
339  stream.next(m.header);
340  stream.next(m.client_id);
341  stream.next(m.marker_name);
342  stream.next(m.control_name);
343  stream.next(m.event_type);
344  stream.next(m.pose);
345  stream.next(m.menu_entry_id);
346  stream.next(m.mouse_point);
347  stream.next(m.mouse_point_valid);
348  }
349 
351  }; // struct InteractiveMarkerFeedback_
352 
353 } // namespace serialization
354 } // namespace roswrap
355 
356 namespace roswrap
357 {
358 namespace message_operations
359 {
360 
361 template<class ContainerAllocator>
363 {
364  template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::visualization_msgs::InteractiveMarkerFeedback_<ContainerAllocator>& v)
365  {
366  s << indent << "header: ";
367  s << std::endl;
369  s << indent << "client_id: ";
370  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.client_id);
371  s << indent << "marker_name: ";
372  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.marker_name);
373  s << indent << "control_name: ";
374  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.control_name);
375  s << indent << "event_type: ";
376  Printer<uint8_t>::stream(s, indent + " ", v.event_type);
377  s << indent << "pose: ";
378  s << std::endl;
380  s << indent << "menu_entry_id: ";
381  Printer<uint32_t>::stream(s, indent + " ", v.menu_entry_id);
382  s << indent << "mouse_point: ";
383  s << std::endl;
385  s << indent << "mouse_point_valid: ";
386  Printer<uint8_t>::stream(s, indent + " ", v.mouse_point_valid);
387  }
388 };
389 
390 } // namespace message_operations
391 } // namespace roswrap
392 
393 #endif // VISUALIZATION_MSGS_MESSAGE_INTERACTIVEMARKERFEEDBACK_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::InteractiveMarkerFeedbackConstPtr
std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback const > InteractiveMarkerFeedbackConstPtr
Definition: InteractiveMarkerFeedback.h:123
roswrap::message_traits::Definition< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > &)
Definition: InteractiveMarkerFeedback.h:324
visualization_msgs::operator!=
bool operator!=(const ::visualization_msgs::ImageMarker_< ContainerAllocator1 > &lhs, const ::visualization_msgs::ImageMarker_< ContainerAllocator2 > &rhs)
Definition: ImageMarker.h:197
visualization_msgs::InteractiveMarkerFeedback_::_mouse_point_valid_type
uint8_t _mouse_point_valid_type
Definition: InteractiveMarkerFeedback.h:80
visualization_msgs::InteractiveMarkerFeedback_::header
_header_type header
Definition: InteractiveMarkerFeedback.h:57
Point.h
multiscan_pcap_player.indent
indent
Definition: multiscan_pcap_player.py:252
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::InteractiveMarkerFeedback_::_client_id_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _client_id_type
Definition: InteractiveMarkerFeedback.h:59
roswrap::message_traits::MD5Sum< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > &)
Definition: InteractiveMarkerFeedback.h:220
visualization_msgs::InteractiveMarkerFeedback_::_mouse_point_type
::geometry_msgs::Point_< ContainerAllocator > _mouse_point_type
Definition: InteractiveMarkerFeedback.h:77
const
#define const
Definition: getopt.c:38
visualization_msgs::InteractiveMarkerFeedback_::control_name
_control_name_type control_name
Definition: InteractiveMarkerFeedback.h:66
s
XmlRpcServer s
visualization_msgs::InteractiveMarkerFeedback_::_control_name_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _control_name_type
Definition: InteractiveMarkerFeedback.h:65
visualization_msgs::InteractiveMarkerFeedback_::marker_name
_marker_name_type marker_name
Definition: InteractiveMarkerFeedback.h:63
Pose.h
visualization_msgs::InteractiveMarkerFeedback_::mouse_point
_mouse_point_type mouse_point
Definition: InteractiveMarkerFeedback.h:78
visualization_msgs::InteractiveMarkerFeedback_::MENU_SELECT
@ MENU_SELECT
Definition: InteractiveMarkerFeedback.h:108
roswrap::serialization::Serializer< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::allInOne
static void allInOne(Stream &stream, T m)
Definition: InteractiveMarkerFeedback.h:337
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::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
visualization_msgs::InteractiveMarkerFeedback_::event_type
_event_type_type event_type
Definition: InteractiveMarkerFeedback.h:69
visualization_msgs::InteractiveMarkerFeedback_::Type
InteractiveMarkerFeedback_< ContainerAllocator > Type
Definition: InteractiveMarkerFeedback.h:28
visualization_msgs::InteractiveMarkerFeedback_::_marker_name_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _marker_name_type
Definition: InteractiveMarkerFeedback.h:62
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::operator==
bool operator==(const ::visualization_msgs::ImageMarker_< ContainerAllocator1 > &lhs, const ::visualization_msgs::ImageMarker_< ContainerAllocator2 > &rhs)
Definition: ImageMarker.h:179
visualization_msgs::InteractiveMarkerFeedback_::mouse_point_valid
_mouse_point_valid_type mouse_point_valid
Definition: InteractiveMarkerFeedback.h:81
visualization_msgs::InteractiveMarkerFeedback_::ConstPtr
std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > const > ConstPtr
Definition: InteractiveMarkerFeedback.h:116
roswrap::message_traits::DataType
Specialize to provide the datatype for a message.
Definition: message_traits.h:135
roswrap::message_traits::Definition
Specialize to provide the definition for a message.
Definition: message_traits.h:152
visualization_msgs::operator<<
std::ostream & operator<<(std::ostream &s, const ::visualization_msgs::ImageMarker_< ContainerAllocator > &v)
Definition: ImageMarker.h:171
visualization_msgs::InteractiveMarkerFeedback_::Ptr
std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > > Ptr
Definition: InteractiveMarkerFeedback.h:115
geometry_msgs::Pose_
Definition: Pose.h:25
visualization_msgs::InteractiveMarkerFeedback_::pose
_pose_type pose
Definition: InteractiveMarkerFeedback.h:72
roswrap::message_traits::MD5Sum< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::value
static const char * value()
Definition: InteractiveMarkerFeedback.h:215
visualization_msgs::InteractiveMarkerFeedback_
Definition: InteractiveMarkerFeedback.h:26
visualization_msgs::InteractiveMarkerFeedback_::_menu_entry_id_type
uint32_t _menu_entry_id_type
Definition: InteractiveMarkerFeedback.h:74
visualization_msgs::InteractiveMarkerFeedback_::BUTTON_CLICK
@ BUTTON_CLICK
Definition: InteractiveMarkerFeedback.h:109
visualization_msgs::InteractiveMarkerFeedback_::MOUSE_DOWN
@ MOUSE_DOWN
Definition: InteractiveMarkerFeedback.h:110
visualization_msgs::InteractiveMarkerFeedback_::InteractiveMarkerFeedback_
InteractiveMarkerFeedback_()
Definition: InteractiveMarkerFeedback.h:30
visualization_msgs::InteractiveMarkerFeedback_::KEEP_ALIVE
@ KEEP_ALIVE
Definition: InteractiveMarkerFeedback.h:106
roswrap
Definition: param_modi.cpp:41
roswrap::message_traits::DataType< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::value
static const char * value(const ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > &)
Definition: InteractiveMarkerFeedback.h:233
roswrap::message_operations::Printer
Definition: message_operations.h:40
std_msgs::Header_
Definition: Header.h:23
visualization_msgs::InteractiveMarkerFeedback_::MOUSE_UP
@ MOUSE_UP
Definition: InteractiveMarkerFeedback.h:111
visualization_msgs::InteractiveMarkerFeedback_::menu_entry_id
_menu_entry_id_type menu_entry_id
Definition: InteractiveMarkerFeedback.h:75
visualization_msgs::InteractiveMarkerFeedback_::client_id
_client_id_type client_id
Definition: InteractiveMarkerFeedback.h:60
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::InteractiveMarkerFeedback_::_header_type
::std_msgs::Header_< ContainerAllocator > _header_type
Definition: InteractiveMarkerFeedback.h:56
visualization_msgs
Definition: ImageMarker.h:26
roswrap::message_traits::Definition< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::value
static const char * value()
Definition: InteractiveMarkerFeedback.h:239
visualization_msgs::InteractiveMarkerFeedback_::POSE_UPDATE
@ POSE_UPDATE
Definition: InteractiveMarkerFeedback.h:107
roswrap::message_traits::IsMessage
Am I message or not.
Definition: message_traits.h:112
roswrap::message_traits::DataType< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::value
static const char * value()
Definition: InteractiveMarkerFeedback.h:228
visualization_msgs::InteractiveMarkerFeedback_::_event_type_type
uint8_t _event_type_type
Definition: InteractiveMarkerFeedback.h:68
visualization_msgs::InteractiveMarkerFeedback
::visualization_msgs::InteractiveMarkerFeedback_< std::allocator< void > > InteractiveMarkerFeedback
Definition: InteractiveMarkerFeedback.h:120
sick_scan_base.h
roswrap::serialization::Stream
Stream base-class, provides common functionality for IStream and OStream.
Definition: serialization.h:705
visualization_msgs::InteractiveMarkerFeedback_::_pose_type
::geometry_msgs::Pose_< ContainerAllocator > _pose_type
Definition: InteractiveMarkerFeedback.h:71
visualization_msgs::InteractiveMarkerFeedback_::InteractiveMarkerFeedback_
InteractiveMarkerFeedback_(const ContainerAllocator &_alloc)
Definition: InteractiveMarkerFeedback.h:41
geometry_msgs::Point_
Definition: Point.h:23
visualization_msgs::InteractiveMarkerFeedbackPtr
std::shared_ptr< ::visualization_msgs::InteractiveMarkerFeedback > InteractiveMarkerFeedbackPtr
Definition: InteractiveMarkerFeedback.h:122
Header.h
roswrap::message_operations::Printer< ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > >::stream
static void stream(Stream &s, const std::string &indent, const ::visualization_msgs::InteractiveMarkerFeedback_< ContainerAllocator > &v)
Definition: InteractiveMarkerFeedback.h:364


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