6 #ifndef VISUALIZATION_MSGS_MESSAGE_IMAGEMARKER_H
7 #define VISUALIZATION_MSGS_MESSAGE_IMAGEMARKER_H
14 #include <ros/types.h>
15 #include <ros/serialization.h>
16 #include <ros/builtin_message_traits.h>
17 #include <ros/message_operations.h>
28 template <
class ContainerAllocator>
70 typedef std::basic_string<char, std::char_traits<char>,
typename ContainerAllocator::template rebind<char>::other >
_ns_type;
100 typedef std::vector< ::geometry_msgs::Point_<ContainerAllocator> ,
typename ContainerAllocator::template rebind< ::geometry_msgs::Point_<ContainerAllocator> >::other >
_points_type;
103 typedef std::vector< ::std_msgs::ColorRGBA_<ContainerAllocator> ,
typename ContainerAllocator::template rebind< ::std_msgs::ColorRGBA_<ContainerAllocator> >::other >
_outline_colors_type;
109 #if defined(_WIN32) && defined(CIRCLE)
112 #if defined(_WIN32) && defined(LINE_STRIP)
115 #if defined(_WIN32) && defined(LINE_LIST)
118 #if defined(_WIN32) && defined(POLYGON)
121 #if defined(_WIN32) && defined(POINTS)
124 #if defined(_WIN32) && defined(ADD)
127 #if defined(_WIN32) && defined(REMOVE)
142 typedef std::shared_ptr< ::visualization_msgs::ImageMarker_<ContainerAllocator> >
Ptr;
143 typedef std::shared_ptr< ::visualization_msgs::ImageMarker_<ContainerAllocator>
const>
ConstPtr;
147 typedef ::visualization_msgs::ImageMarker_<std::allocator<void> >
ImageMarker;
170 template<
typename ContainerAllocator>
171 std::ostream&
operator<<(std::ostream& s, const ::visualization_msgs::ImageMarker_<ContainerAllocator> & v)
178 template<
typename ContainerAllocator1,
typename ContainerAllocator2>
179 bool operator==(const ::visualization_msgs::ImageMarker_<ContainerAllocator1> & lhs, const ::visualization_msgs::ImageMarker_<ContainerAllocator2> & rhs)
181 return lhs.header == rhs.header &&
184 lhs.type == rhs.type &&
185 lhs.action == rhs.action &&
186 lhs.position == rhs.position &&
187 lhs.scale == rhs.scale &&
188 lhs.outline_color == rhs.outline_color &&
189 lhs.filled == rhs.filled &&
190 lhs.fill_color == rhs.fill_color &&
191 lhs.lifetime == rhs.lifetime &&
192 lhs.points == rhs.points &&
193 lhs.outline_colors == rhs.outline_colors;
196 template<
typename ContainerAllocator1,
typename ContainerAllocator2>
197 bool operator!=(const ::visualization_msgs::ImageMarker_<ContainerAllocator1> & lhs, const ::visualization_msgs::ImageMarker_<ContainerAllocator2> & rhs)
199 return !(lhs == rhs);
207 namespace message_traits
214 template <
class ContainerAllocator>
219 template <
class ContainerAllocator>
224 template <
class ContainerAllocator>
229 template <
class ContainerAllocator>
234 template <
class ContainerAllocator>
239 template <
class ContainerAllocator>
245 template<
class ContainerAllocator>
250 return "1de93c67ec8858b831025a08fbf1b35c";
253 static const char*
value(const ::visualization_msgs::ImageMarker_<ContainerAllocator>&) {
return value(); }
254 static const uint64_t static_value1 = 0x1de93c67ec8858b8ULL;
255 static const uint64_t static_value2 = 0x31025a08fbf1b35cULL;
258 template<
class ContainerAllocator>
263 return "visualization_msgs/ImageMarker";
266 static const char*
value(const ::visualization_msgs::ImageMarker_<ContainerAllocator>&) {
return value(); }
269 template<
class ContainerAllocator>
274 return "uint8 CIRCLE=0\n"
275 "uint8 LINE_STRIP=1\n"
276 "uint8 LINE_LIST=2\n"
284 "string ns # namespace, used with id to form a unique id\n"
285 "int32 id # unique id within the namespace\n"
286 "int32 type # CIRCLE/LINE_STRIP/etc.\n"
287 "int32 action # ADD/REMOVE\n"
288 "geometry_msgs/Point position # 2D, in pixel-coords\n"
289 "float32 scale # the diameter for a circle, etc.\n"
290 "std_msgs/ColorRGBA outline_color\n"
291 "uint8 filled # whether to fill in the shape with color\n"
292 "std_msgs/ColorRGBA fill_color # color [0.0-1.0]\n"
293 "duration lifetime # How long the object should last before being automatically deleted. 0 means forever\n"
296 "geometry_msgs/Point[] points # used for LINE_STRIP/LINE_LIST/POINTS/etc., 2D in pixel coords\n"
297 "std_msgs/ColorRGBA[] outline_colors # a color for each line, point, etc.\n"
298 "================================================================================\n"
299 "MSG: std_msgs/Header\n"
300 "# Standard metadata for higher-level stamped data types.\n"
301 "# This is generally used to communicate timestamped data \n"
302 "# in a particular coordinate frame.\n"
304 "# sequence ID: consecutively increasing ID \n"
306 "#Two-integer timestamp that is expressed as:\n"
307 "# * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n"
308 "# * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n"
309 "# time-handling sugar is provided by the client library\n"
311 "#Frame this data is associated with\n"
314 "================================================================================\n"
315 "MSG: geometry_msgs/Point\n"
316 "# This contains the position of a point in free space\n"
321 "================================================================================\n"
322 "MSG: std_msgs/ColorRGBA\n"
330 static const char*
value(const ::visualization_msgs::ImageMarker_<ContainerAllocator>&) {
return value(); }
338 namespace serialization
343 template<
typename Stream,
typename T>
inline static void allInOne(
Stream& stream, T m)
345 stream.next(m.header);
349 stream.next(m.action);
350 stream.next(m.position);
351 stream.next(m.scale);
352 stream.next(m.outline_color);
353 stream.next(m.filled);
354 stream.next(m.fill_color);
355 stream.next(m.lifetime);
356 stream.next(m.points);
357 stream.next(m.outline_colors);
368 namespace message_operations
371 template<
class ContainerAllocator>
374 template<
typename Stream>
static void stream(Stream& s,
const std::string&
indent, const ::visualization_msgs::ImageMarker_<ContainerAllocator>& v)
392 s <<
indent <<
"outline_color: ";
402 s <<
indent <<
"points[]" << std::endl;
403 for (
size_t i = 0; i < v.points.size(); ++i)
405 s <<
indent <<
" points[" << i <<
"]: ";
410 s <<
indent <<
"outline_colors[]" << std::endl;
411 for (
size_t i = 0; i < v.outline_colors.size(); ++i)
413 s <<
indent <<
" outline_colors[" << i <<
"]: ";
424 #endif // VISUALIZATION_MSGS_MESSAGE_IMAGEMARKER_H