#include <labust/tools/conversions.hpp>#include <labust/tools/MatrixLoader.hpp>#include <labust/math/NumberManipulation.hpp>#include <std_msgs/Float32MultiArray.h>#include <std_msgs/String.h>#include <sensor_msgs/Imu.h>#include <sensor_msgs/NavSatFix.h>#include <tf/transform_broadcaster.h>#include <ros/ros.h>#include <boost/bind.hpp>#include <boost/asio.hpp>#include <boost/regex.hpp>#include <boost/thread.hpp>#include <iostream>#include <numeric>
Go to the source code of this file.
Classes | |
| struct | SharedData |
Functions | |
| void | handleIncoming (SharedData &shared, boost::asio::serial_port &port, const boost::system::error_code &error, const size_t &transferred) |
| int | main (int argc, char *argv[]) |
| void | start_receive (SharedData &shared, boost::asio::serial_port &port, bool single=false) |
| void | sync (SharedData &shared, boost::asio::serial_port &port, const boost::system::error_code &error, const size_t &transferred) |
| void handleIncoming | ( | SharedData & | shared, |
| boost::asio::serial_port & | port, | ||
| const boost::system::error_code & | error, | ||
| const size_t & | transferred | ||
| ) |
Definition at line 107 of file imu_node.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 243 of file imu_node.cpp.
| void start_receive | ( | SharedData & | shared, |
| boost::asio::serial_port & | port, | ||
| bool | single = false |
||
| ) |
Definition at line 224 of file imu_node.cpp.
| void sync | ( | SharedData & | shared, |
| boost::asio::serial_port & | port, | ||
| const boost::system::error_code & | error, | ||
| const size_t & | transferred | ||
| ) |
Definition at line 79 of file imu_node.cpp.