Public Member Functions | |
PPExplorerComm () | |
~PPExplorerComm () | |
Private Member Functions | |
void | localNoseCallback (const boost::shared_ptr< const lse_sensor_msgs::Nostril > &msg) |
void | othersNoseCallback (const pp_explorer::ForeignNostril::ConstPtr &msg) |
void | robotJoinedNetwork (char *ip) |
Private Attributes | |
tf::TransformBroadcaster | broadcaster_ |
WiFiComm * | comm |
ros::Publisher | foreign_nose_pub_ |
ros::Subscriber | foreign_nose_sub_ |
ros::NodeHandle | n_ |
ros::Publisher | nose_pub_ |
message_filters::Subscriber < lse_sensor_msgs::Nostril > | nose_sub_ |
Nose topic subscriber. | |
tf::TransformListener | tf_ |
Transform listener. | |
tf::MessageFilter < lse_sensor_msgs::Nostril > * | tf_filter_ |
Definition at line 57 of file pp_explorer_comm.cpp.
Definition at line 85 of file pp_explorer_comm.cpp.
Definition at line 99 of file pp_explorer_comm.cpp.
void PPExplorerComm::localNoseCallback | ( | const boost::shared_ptr< const lse_sensor_msgs::Nostril > & | msg | ) | [private] |
Definition at line 104 of file pp_explorer_comm.cpp.
void PPExplorerComm::othersNoseCallback | ( | const pp_explorer::ForeignNostril::ConstPtr & | msg | ) | [private] |
Definition at line 134 of file pp_explorer_comm.cpp.
void PPExplorerComm::robotJoinedNetwork | ( | char * | ip | ) | [private] |
Definition at line 146 of file pp_explorer_comm.cpp.
Definition at line 73 of file pp_explorer_comm.cpp.
WiFiComm* PPExplorerComm::comm [private] |
Definition at line 64 of file pp_explorer_comm.cpp.
Definition at line 75 of file pp_explorer_comm.cpp.
Definition at line 76 of file pp_explorer_comm.cpp.
ros::NodeHandle PPExplorerComm::n_ [private] |
Definition at line 65 of file pp_explorer_comm.cpp.
ros::Publisher PPExplorerComm::nose_pub_ [private] |
Definition at line 78 of file pp_explorer_comm.cpp.
Nose topic subscriber.
Definition at line 68 of file pp_explorer_comm.cpp.
tf::TransformListener PPExplorerComm::tf_ [private] |
Transform listener.
Definition at line 70 of file pp_explorer_comm.cpp.
Definition at line 71 of file pp_explorer_comm.cpp.