#include <boost/asio.hpp>
#include <labust/tools/GeoUtilities.hpp>
#include <labust/tools/StringUtilities.hpp>
#include <ros/ros.h>
#include <auv_msgs/NavSts.h>
#include <geometry_msgs/PointStamped.h>
#include <tf/transform_listener.h>
#include <string>
Go to the source code of this file.
Classes | |
struct | SharedData |
Functions | |
uint8_t | aisConvertByte (uint8_t byte) |
void | aivdm (long lat, long lon, int hdg) |
void | aivdm2 (long lat, long lon, int hdg, std::string &ais, bool isTarget=false) |
int | main (int argc, char *argv[]) |
void | onData (SharedData &shared, bool isTarget, const auv_msgs::NavSts::ConstPtr data) |
uint8_t aisConvertByte | ( | uint8_t | byte | ) |
Definition at line 57 of file position_repost.cpp.
void aivdm | ( | long | lat, |
long | lon, | ||
int | hdg | ||
) |
Definition at line 123 of file position_repost.cpp.
void aivdm2 | ( | long | lat, |
long | lon, | ||
int | hdg, | ||
std::string & | ais, | ||
bool | isTarget = false |
||
) |
Definition at line 71 of file position_repost.cpp.
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 247 of file position_repost.cpp.
void onData | ( | SharedData & | shared, |
bool | isTarget, | ||
const auv_msgs::NavSts::ConstPtr | data | ||
) |
Definition at line 212 of file position_repost.cpp.