#include <listeners.hpp>

Public Member Functions | |
| Gps () | |
| void | subscribe () |
Private Member Functions | |
| void | _chatterCallback (const sensor_msgs::NavSatFix::ConstPtr &msg) |
Private Attributes | |
| ros::NodeHandle | _nHandle |
| ros::Subscriber | _sub |
| std::string | _topicName |
Definition at line 99 of file listeners.hpp.
| Gps::Gps | ( | ) | [inline] |
Definition at line 102 of file listeners.hpp.
| void Gps::_chatterCallback | ( | const sensor_msgs::NavSatFix::ConstPtr & | msg | ) | [inline, private] |
Definition at line 114 of file listeners.hpp.
| void Gps::subscribe | ( | ) | [inline, virtual] |
Implements Listener.
Definition at line 103 of file listeners.hpp.
ros::NodeHandle Gps::_nHandle [private] |
Definition at line 110 of file listeners.hpp.
ros::Subscriber Gps::_sub [private] |
Definition at line 111 of file listeners.hpp.
std::string Gps::_topicName [private] |
Definition at line 112 of file listeners.hpp.