| Public Member Functions | |
| GPSSim () | |
| void | onOdom (const typename nav_msgs::Odometry::ConstPtr &msg) | 
| Private Attributes | |
| tf2_ros::TransformBroadcaster | broadcaster | 
| tf2_ros::Buffer | buffer | 
| ros::Publisher | gps_pub | 
| double | gps_z | 
| tf2_ros::TransformListener | listener | 
| ros::Subscriber | odom | 
| int | rate | 
Definition at line 48 of file GPSSim.cpp.
| GPSSim::GPSSim | ( | ) |  [inline] | 
Definition at line 50 of file GPSSim.cpp.
| void GPSSim::onOdom | ( | const typename nav_msgs::Odometry::ConstPtr & | msg | ) |  [inline] | 
Definition at line 63 of file GPSSim.cpp.
Definition at line 122 of file GPSSim.cpp.
| tf2_ros::Buffer GPSSim::buffer  [private] | 
Definition at line 120 of file GPSSim.cpp.
| ros::Publisher GPSSim::gps_pub  [private] | 
Definition at line 118 of file GPSSim.cpp.
| double GPSSim::gps_z  [private] | 
Definition at line 123 of file GPSSim.cpp.
| tf2_ros::TransformListener GPSSim::listener  [private] | 
Definition at line 121 of file GPSSim.cpp.
| ros::Subscriber GPSSim::odom  [private] | 
Definition at line 117 of file GPSSim.cpp.
| int GPSSim::rate  [private] | 
Definition at line 119 of file GPSSim.cpp.