#include <sensor_msgs/Imu.h>
#include <geometry_msgs/WrenchStamped.h>
#include <sensor_msgs/Temperature.h>
#include <rokubimini/Statusword.hpp>
#include <boost/math/constants/constants.hpp>
Go to the source code of this file.
Classes | |
class | rokubimini::Reading |
Class representing the readings received from the rokubi mini devices. More... | |
Namespaces | |
rokubimini | |
Tests Configuration. | |
Variables | |
static constexpr double | rokubimini::DEG_TO_RAD = boost::math::constants::pi<double>() / 180 |
degrees to rad abbreviation for convenience. More... | |
static constexpr double | rokubimini::G_TO_METERS_PER_SECOND_SQUARED = 9.80665 |
g to m/s^2 abbreviation for convenience. More... | |