#include <boost/asio.hpp>#include <labust/tools/GeoUtilities.hpp>#include <ros/ros.h>#include <auv_msgs/NavSts.h>#include <geometry_msgs/PointStamped.h>#include <boost/thread.hpp>#include <string>
Go to the source code of this file.
Classes | |
| struct | SharedData |
Functions | |
| void | handle_receive (SharedData &shared, const boost::system::error_code &e, size_t length) |
| int | main (int argc, char *argv[]) |
| void | onData (SharedData &shared, const auv_msgs::NavSts::ConstPtr data) |
| void | start_receive (SharedData &shared) |
| void handle_receive | ( | SharedData & | shared, |
| const boost::system::error_code & | e, | ||
| size_t | length | ||
| ) |
Definition at line 89 of file coop_node.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 111 of file coop_node.cpp.
| void onData | ( | SharedData & | shared, |
| const auv_msgs::NavSts::ConstPtr | data | ||
| ) |
Definition at line 56 of file coop_node.cpp.
| void start_receive | ( | SharedData & | shared | ) |
Definition at line 83 of file coop_node.cpp.