#include "serialkey.h"
#include <iostream>
#include <list>
#include <iomanip>
#include <stdexcept>
#include <xsens/xstime.h>
#include "conio.h"
#include <ros/ros.h>
#include <ros/console.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/NavSatFix.h>
#include <sensor_msgs/Temperature.h>
#include <sensor_msgs/MagneticField.h>
#include <sensor_msgs/FluidPressure.h>
#include <geometry_msgs/Twist.h>
#include "mtiG.h"
Go to the source code of this file.
Classes | |
class | CallbackHandler |
Callback handler for incoming data packets from the device. More... | |
struct | CallbackHandler::Locker |
Functions | |
int | main (int argc, char **argv) |
initializes ros nodes, establishes connection to the device and starts reading from it. |