NavSatFix.h
Go to the documentation of this file.
1 // Generated by gencpp from file sensor_msgs/NavSatFix.msg
2 // DO NOT EDIT!
3 
4 
5 #ifndef SENSOR_MSGS_MESSAGE_NAVSATFIX_H
6 #define SENSOR_MSGS_MESSAGE_NAVSATFIX_H
7 
8 
9 #include <string>
10 #include <vector>
11 #include <map>
12 
13 #include <ros/types.h>
14 #include <ros/serialization.h>
16 #include <ros/message_operations.h>
17 
18 #include <std_msgs/Header.h>
20 
21 namespace sensor_msgs
22 {
23 template <class ContainerAllocator>
24 struct NavSatFix_
25 {
27 
29  : header()
30  , status()
31  , latitude(0.0)
32  , longitude(0.0)
33  , altitude(0.0)
36  position_covariance.assign(0.0);
37  }
38  NavSatFix_(const ContainerAllocator& _alloc)
39  : header(_alloc)
40  , status(_alloc)
41  , latitude(0.0)
42  , longitude(0.0)
43  , altitude(0.0)
46  (void)_alloc;
47  position_covariance.assign(0.0);
48  }
49 
50 
51 
52  typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
53  _header_type header;
54 
55  typedef ::sensor_msgs::NavSatStatus_<ContainerAllocator> _status_type;
56  _status_type status;
57 
58  typedef double _latitude_type;
59  _latitude_type latitude;
60 
61  typedef double _longitude_type;
62  _longitude_type longitude;
63 
64  typedef double _altitude_type;
65  _altitude_type altitude;
66 
67  typedef boost::array<double, 9> _position_covariance_type;
68  _position_covariance_type position_covariance;
69 
71  _position_covariance_type_type position_covariance_type;
72 
73 
74  enum { COVARIANCE_TYPE_UNKNOWN = 0u };
77  enum { COVARIANCE_TYPE_KNOWN = 3u };
78 
79 
82 
83 }; // struct NavSatFix_
84 
85 typedef ::sensor_msgs::NavSatFix_<std::allocator<void> > NavSatFix;
86 
89 
90 // constants requiring out of line definition
91 
92 
93 
94 
95 
96 
97 
98 
99 
100 
101 
102 template<typename ContainerAllocator>
103 std::ostream& operator<<(std::ostream& s, const ::sensor_msgs::NavSatFix_<ContainerAllocator> & v)
104 {
106 return s;
107 }
108 
109 } // namespace sensor_msgs
110 
111 namespace rs2rosinternal
112 {
113 namespace message_traits
114 {
115 
116 
117 
118 // BOOLTRAITS {'IsFixedSize': False, 'IsMessage': True, 'HasHeader': True}
119 // {'std_msgs': ['/opt/ros/kinetic/share/std_msgs/cmake/../msg'], 'geometry_msgs': ['/opt/ros/kinetic/share/geometry_msgs/cmake/../msg'], 'sensor_msgs': ['/tmp/binarydeb/ros-kinetic-sensor-msgs-1.12.5/msg']}
120 
121 // !!!!!!!!!!! ['__class__', '__delattr__', '__dict__', '__doc__', '__eq__', '__format__', '__getattribute__', '__hash__', '__init__', '__module__', '__ne__', '__new__', '__reduce__', '__reduce_ex__', '__repr__', '__setattr__', '__sizeof__', '__str__', '__subclasshook__', '__weakref__', '_parsed_fields', 'constants', 'fields', 'full_name', 'has_header', 'header_present', 'names', 'package', 'parsed_fields', 'short_name', 'text', 'types']
122 
123 
124 
125 
126 template <class ContainerAllocator>
127 struct IsFixedSize< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
128  : FalseType
129  { };
130 
131 template <class ContainerAllocator>
132 struct IsFixedSize< ::sensor_msgs::NavSatFix_<ContainerAllocator> const>
133  : FalseType
134  { };
135 
136 template <class ContainerAllocator>
137 struct IsMessage< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
138  : TrueType
139  { };
140 
141 template <class ContainerAllocator>
142 struct IsMessage< ::sensor_msgs::NavSatFix_<ContainerAllocator> const>
143  : TrueType
144  { };
145 
146 template <class ContainerAllocator>
147 struct HasHeader< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
148  : TrueType
149  { };
150 
151 template <class ContainerAllocator>
152 struct HasHeader< ::sensor_msgs::NavSatFix_<ContainerAllocator> const>
153  : TrueType
154  { };
155 
156 
157 template<class ContainerAllocator>
158 struct MD5Sum< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
159 {
160  static const char* value()
161  {
162  return "2d3a8cd499b9b4a0249fb98fd05cfa48";
163  }
164 
165  static const char* value(const ::sensor_msgs::NavSatFix_<ContainerAllocator>&) { return value(); }
166  static const uint64_t static_value1 = 0x2d3a8cd499b9b4a0ULL;
167  static const uint64_t static_value2 = 0x249fb98fd05cfa48ULL;
168 };
169 
170 template<class ContainerAllocator>
171 struct DataType< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
172 {
173  static const char* value()
174  {
175  return "sensor_msgs/NavSatFix";
176  }
177 
178  static const char* value(const ::sensor_msgs::NavSatFix_<ContainerAllocator>&) { return value(); }
179 };
180 
181 template<class ContainerAllocator>
182 struct Definition< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
183 {
184  static const char* value()
185  {
186  return "# Navigation Satellite fix for any Global Navigation Satellite System\n\
187 #\n\
188 # Specified using the WGS 84 reference ellipsoid\n\
189 \n\
190 # header.stamp specifies the ROS time for this measurement (the\n\
191 # corresponding satellite time may be reported using the\n\
192 # sensor_msgs/TimeReference message).\n\
193 #\n\
194 # header.frame_id is the frame of reference reported by the satellite\n\
195 # receiver, usually the location of the antenna. This is a\n\
196 # Euclidean frame relative to the vehicle, not a reference\n\
197 # ellipsoid.\n\
198 Header header\n\
199 \n\
200 # satellite fix status information\n\
201 NavSatStatus status\n\
202 \n\
203 # Latitude [degrees]. Positive is north of equator; negative is south.\n\
204 float64 latitude\n\
205 \n\
206 # Longitude [degrees]. Positive is east of prime meridian; negative is west.\n\
207 float64 longitude\n\
208 \n\
209 # Altitude [m]. Positive is above the WGS 84 ellipsoid\n\
210 # (quiet NaN if no altitude is available).\n\
211 float64 altitude\n\
212 \n\
213 # Position covariance [m^2] defined relative to a tangential plane\n\
214 # through the reported position. The components are East, North, and\n\
215 # Up (ENU), in row-major order.\n\
216 #\n\
217 # Beware: this coordinate system exhibits singularities at the poles.\n\
218 \n\
219 float64[9] position_covariance\n\
220 \n\
221 # If the covariance of the fix is known, fill it in completely. If the\n\
222 # GPS receiver provides the variance of each measurement, put them\n\
223 # along the diagonal. If only Dilution of Precision is available,\n\
224 # estimate an approximate covariance from that.\n\
225 \n\
226 uint8 COVARIANCE_TYPE_UNKNOWN = 0\n\
227 uint8 COVARIANCE_TYPE_APPROXIMATED = 1\n\
228 uint8 COVARIANCE_TYPE_DIAGONAL_KNOWN = 2\n\
229 uint8 COVARIANCE_TYPE_KNOWN = 3\n\
230 \n\
231 uint8 position_covariance_type\n\
232 \n\
233 ================================================================================\n\
234 MSG: std_msgs/Header\n\
235 # Standard metadata for higher-level stamped data types.\n\
236 # This is generally used to communicate timestamped data \n\
237 # in a particular coordinate frame.\n\
238 # \n\
239 # sequence ID: consecutively increasing ID \n\
240 uint32 seq\n\
241 #Two-integer timestamp that is expressed as:\n\
242 # * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n\
243 # * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n\
244 # time-handling sugar is provided by the client library\n\
245 time stamp\n\
246 #Frame this data is associated with\n\
247 # 0: no frame\n\
248 # 1: global frame\n\
249 string frame_id\n\
250 \n\
251 ================================================================================\n\
252 MSG: sensor_msgs/NavSatStatus\n\
253 # Navigation Satellite fix status for any Global Navigation Satellite System\n\
254 \n\
255 # Whether to output an augmented fix is determined by both the fix\n\
256 # type and the last time differential corrections were received. A\n\
257 # fix is valid when status >= STATUS_FIX.\n\
258 \n\
259 int8 STATUS_NO_FIX = -1 # unable to fix position\n\
260 int8 STATUS_FIX = 0 # unaugmented fix\n\
261 int8 STATUS_SBAS_FIX = 1 # with satellite-based augmentation\n\
262 int8 STATUS_GBAS_FIX = 2 # with ground-based augmentation\n\
263 \n\
264 int8 status\n\
265 \n\
266 # Bits defining which Global Navigation Satellite System signals were\n\
267 # used by the receiver.\n\
268 \n\
269 uint16 SERVICE_GPS = 1\n\
270 uint16 SERVICE_GLONASS = 2\n\
271 uint16 SERVICE_COMPASS = 4 # includes BeiDou.\n\
272 uint16 SERVICE_GALILEO = 8\n\
273 \n\
274 uint16 service\n\
275 ";
276  }
277 
278  static const char* value(const ::sensor_msgs::NavSatFix_<ContainerAllocator>&) { return value(); }
279 };
280 
281 } // namespace message_traits
282 } // namespace rs2rosinternal
283 
284 namespace rs2rosinternal
285 {
286 namespace serialization
287 {
288 
289  template<class ContainerAllocator> struct Serializer< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
290  {
291  template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
292  {
293  stream.next(m.header);
294  stream.next(m.status);
295  stream.next(m.latitude);
296  stream.next(m.longitude);
297  stream.next(m.altitude);
298  stream.next(m.position_covariance);
299  stream.next(m.position_covariance_type);
300  }
301 
303  }; // struct NavSatFix_
304 
305 } // namespace serialization
306 } // namespace rs2rosinternal
307 
308 namespace rs2rosinternal
309 {
310 namespace message_operations
311 {
312 
313 template<class ContainerAllocator>
314 struct Printer< ::sensor_msgs::NavSatFix_<ContainerAllocator> >
315 {
316  template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::sensor_msgs::NavSatFix_<ContainerAllocator>& v)
317  {
318  s << indent << "header: ";
319  s << std::endl;
321  s << indent << "status: ";
322  s << std::endl;
324  s << indent << "latitude: ";
325  Printer<double>::stream(s, indent + " ", v.latitude);
326  s << indent << "longitude: ";
327  Printer<double>::stream(s, indent + " ", v.longitude);
328  s << indent << "altitude: ";
329  Printer<double>::stream(s, indent + " ", v.altitude);
330  s << indent << "position_covariance[]" << std::endl;
331  for (size_t i = 0; i < v.position_covariance.size(); ++i)
332  {
333  s << indent << " position_covariance[" << i << "]: ";
334  Printer<double>::stream(s, indent + " ", v.position_covariance[i]);
335  }
336  s << indent << "position_covariance_type: ";
337  Printer<uint8_t>::stream(s, indent + " ", v.position_covariance_type);
338  }
339 };
340 
341 } // namespace message_operations
342 } // namespace rs2rosinternal
343 
344 #endif // SENSOR_MSGS_MESSAGE_NAVSATFIX_H
boost::shared_ptr< ::sensor_msgs::NavSatFix > NavSatFixPtr
Definition: NavSatFix.h:87
boost::array< double, 9 > _position_covariance_type
Definition: NavSatFix.h:67
typedef void(APIENTRY *GLDEBUGPROC)(GLenum source
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
NavSatFix_< ContainerAllocator > Type
Definition: NavSatFix.h:26
GLdouble s
const GLfloat * m
Definition: glext.h:6814
Specialize to provide the md5sum for a message.
static const char * value(const ::sensor_msgs::NavSatFix_< ContainerAllocator > &)
Definition: NavSatFix.h:165
_altitude_type altitude
Definition: NavSatFix.h:65
_header_type header
Definition: NavSatFix.h:53
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
uint8_t _position_covariance_type_type
Definition: NavSatFix.h:70
GLsizei const GLchar *const * string
_latitude_type latitude
Definition: NavSatFix.h:59
Specialize to provide the datatype for a message.
HasHeader informs whether or not there is a header that gets serialized as the first thing in the mes...
GLuint GLuint stream
Definition: glext.h:1790
unsigned char uint8_t
Definition: stdint.h:78
::sensor_msgs::NavSatStatus_< ContainerAllocator > _status_type
Definition: NavSatFix.h:55
static void stream(Stream &s, const std::string &indent, const ::sensor_msgs::NavSatFix_< ContainerAllocator > &v)
Definition: NavSatFix.h:316
A fixed-size datatype is one whose size is constant, i.e. it has no variable-length arrays or strings...
static const char * value(const ::sensor_msgs::NavSatFix_< ContainerAllocator > &)
Definition: NavSatFix.h:278
Stream base-class, provides common functionality for IStream and OStream.
::std_msgs::Header_< ContainerAllocator > _header_type
Definition: NavSatFix.h:52
NavSatFix_(const ContainerAllocator &_alloc)
Definition: NavSatFix.h:38
_position_covariance_type position_covariance
Definition: NavSatFix.h:68
Tools for manipulating sensor_msgs.
Definition: BatteryState.h:20
_position_covariance_type_type position_covariance_type
Definition: NavSatFix.h:71
#define ROS_DECLARE_ALLINONE_SERIALIZER
Declare your serializer to use an allInOne member instead of requiring 3 different serialization func...
unsigned __int64 uint64_t
Definition: stdint.h:90
Specialize to provide the definition for a message.
boost::shared_ptr< ::sensor_msgs::NavSatFix_< ContainerAllocator > > Ptr
Definition: NavSatFix.h:80
_longitude_type longitude
Definition: NavSatFix.h:62
_status_type status
Definition: NavSatFix.h:56
int i
static const char * value(const ::sensor_msgs::NavSatFix_< ContainerAllocator > &)
Definition: NavSatFix.h:178
boost::shared_ptr< ::sensor_msgs::NavSatFix const > NavSatFixConstPtr
Definition: NavSatFix.h:88
Templated serialization class. Default implementation provides backwards compatibility with old messa...
boost::shared_ptr< ::sensor_msgs::NavSatFix_< ContainerAllocator > const > ConstPtr
Definition: NavSatFix.h:81
GLdouble v
::sensor_msgs::NavSatFix_< std::allocator< void > > NavSatFix
Definition: NavSatFix.h:85


librealsense2
Author(s): Sergey Dorodnicov , Doron Hirshberg , Mark Horn , Reagan Lopez , Itay Carpis
autogenerated on Mon May 3 2021 02:47:22