| Public Types | |
| enum | { NEEDED_FIXES = 30 } | 
| Public Member Functions | |
| LTPNode () | |
| void | onGps (const sensor_msgs::NavSatFix::ConstPtr &fix) | 
| void | setupFrame () | 
| ~LTPNode () | |
| Private Attributes | |
| tf2_ros::StaticTransformBroadcaster | broadcaster | 
| Transform broadcaster. | |
| int | fix_count | 
| Fix counter. | |
| bool | fix_valid | 
| Valid fix that can be used. | |
| ros::Subscriber | gps_raw | 
| Subscriber to raw GPS data. | |
| double | origin_lat | 
| Local origin latitude. | |
| double | origin_lon | 
| Local origin longitude. | |
| boost::thread | runner | 
| Runner thread. | |
Definition at line 47 of file ltp_node.cpp.
| anonymous enum | 
Definition at line 49 of file ltp_node.cpp.
| LTPNode::LTPNode | ( | ) |  [inline] | 
Definition at line 51 of file ltp_node.cpp.
| LTPNode::~LTPNode | ( | ) |  [inline] | 
Definition at line 72 of file ltp_node.cpp.
| void LTPNode::onGps | ( | const sensor_msgs::NavSatFix::ConstPtr & | fix | ) |  [inline] | 
Definition at line 77 of file ltp_node.cpp.
| void LTPNode::setupFrame | ( | ) |  [inline] | 
Definition at line 92 of file ltp_node.cpp.
Transform broadcaster.
Definition at line 118 of file ltp_node.cpp.
| int LTPNode::fix_count  [private] | 
Fix counter.
Definition at line 126 of file ltp_node.cpp.
| bool LTPNode::fix_valid  [private] | 
Valid fix that can be used.
Definition at line 124 of file ltp_node.cpp.
| ros::Subscriber LTPNode::gps_raw  [private] | 
Subscriber to raw GPS data.
Definition at line 116 of file ltp_node.cpp.
| double LTPNode::origin_lat  [private] | 
Local origin latitude.
Definition at line 120 of file ltp_node.cpp.
| double LTPNode::origin_lon  [private] | 
Local origin longitude.
Definition at line 122 of file ltp_node.cpp.
| boost::thread LTPNode::runner  [private] | 
Runner thread.
Definition at line 128 of file ltp_node.cpp.