#include <GpsInfo.h>
Public Types | |
| enum | { INVALID_FIX = 0 } |
| enum | { GPS_FIX = 1 } |
| enum | { DGPS_FIX = 2 } |
| typedef double | _altitude_type |
| typedef double | _err_horz_type |
| typedef double | _err_vert_type |
| typedef double | _hdop_type |
| typedef ::std_msgs::Header_ < ContainerAllocator > | _header_type |
| typedef double | _latitude_type |
| typedef double | _longitude_type |
| typedef uint16_t | _num_sats_type |
| typedef uint16_t | _quality_type |
| typedef double | _utm_e_type |
| typedef double | _utm_n_type |
| typedef double | _vdop_type |
| typedef std::basic_string < char, std::char_traits< char > , typename ContainerAllocator::template rebind< char >::other > | _zone_type |
| typedef boost::shared_ptr < ::art_msgs::GpsInfo_ < ContainerAllocator > const > | ConstPtr |
| typedef boost::shared_ptr < ::art_msgs::GpsInfo_ < ContainerAllocator > > | Ptr |
| typedef GpsInfo_ < ContainerAllocator > | Type |
Public Member Functions | |
| GpsInfo_ () | |
| GpsInfo_ (const ContainerAllocator &_alloc) | |
Public Attributes | |
| boost::shared_ptr< std::map < std::string, std::string > > | __connection_header |
| double | altitude |
| double | err_horz |
| double | err_vert |
| double | hdop |
| ::std_msgs::Header_ < ContainerAllocator > | header |
| double | latitude |
| double | longitude |
| uint16_t | num_sats |
| uint16_t | quality |
| double | utm_e |
| double | utm_n |
| double | vdop |
| std::basic_string< char, std::char_traits< char > , typename ContainerAllocator::template rebind< char >::other > | zone |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_altitude_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_err_horz_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_err_vert_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_hdop_type |
| typedef ::std_msgs::Header_<ContainerAllocator> art_msgs::GpsInfo_< ContainerAllocator >::_header_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_latitude_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_longitude_type |
| typedef uint16_t art_msgs::GpsInfo_< ContainerAllocator >::_num_sats_type |
| typedef uint16_t art_msgs::GpsInfo_< ContainerAllocator >::_quality_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_utm_e_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_utm_n_type |
| typedef double art_msgs::GpsInfo_< ContainerAllocator >::_vdop_type |
| typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > art_msgs::GpsInfo_< ContainerAllocator >::_zone_type |
| typedef boost::shared_ptr< ::art_msgs::GpsInfo_<ContainerAllocator> const> art_msgs::GpsInfo_< ContainerAllocator >::ConstPtr |
| typedef boost::shared_ptr< ::art_msgs::GpsInfo_<ContainerAllocator> > art_msgs::GpsInfo_< ContainerAllocator >::Ptr |
| typedef GpsInfo_<ContainerAllocator> art_msgs::GpsInfo_< ContainerAllocator >::Type |
| anonymous enum |
| anonymous enum |
| anonymous enum |
| art_msgs::GpsInfo_< ContainerAllocator >::GpsInfo_ | ( | ) | [inline] |
| art_msgs::GpsInfo_< ContainerAllocator >::GpsInfo_ | ( | const ContainerAllocator & | _alloc | ) | [inline] |
| boost::shared_ptr<std::map<std::string, std::string> > art_msgs::GpsInfo_< ContainerAllocator >::__connection_header |
| double art_msgs::GpsInfo_< ContainerAllocator >::altitude |
| double art_msgs::GpsInfo_< ContainerAllocator >::err_horz |
| double art_msgs::GpsInfo_< ContainerAllocator >::err_vert |
| double art_msgs::GpsInfo_< ContainerAllocator >::hdop |
| ::std_msgs::Header_<ContainerAllocator> art_msgs::GpsInfo_< ContainerAllocator >::header |
| double art_msgs::GpsInfo_< ContainerAllocator >::latitude |
| double art_msgs::GpsInfo_< ContainerAllocator >::longitude |
| uint16_t art_msgs::GpsInfo_< ContainerAllocator >::num_sats |
| uint16_t art_msgs::GpsInfo_< ContainerAllocator >::quality |
| double art_msgs::GpsInfo_< ContainerAllocator >::utm_e |
| double art_msgs::GpsInfo_< ContainerAllocator >::utm_n |
| double art_msgs::GpsInfo_< ContainerAllocator >::vdop |
| std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > art_msgs::GpsInfo_< ContainerAllocator >::zone |