#include <ros/ros.h>
#include <ros/service_server.h>
#include <boost/thread/mutex.hpp>
#include <boost/shared_ptr.hpp>
#include <tf/transform_datatypes.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/MagneticField.h>
#include <std_srvs/Empty.h>
#include <std_msgs/Bool.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include <phidgets_api/imu.h>
Go to the source code of this file.
Classes | |
class | phidgets::ImuRosI |
Namespaces | |
phidgets | |
Variables | |
const float | phidgets::G = 9.81 |
const float | phidgets::MAX_TIMEDIFF_SECONDS = 0.1 |