#include <iri_base_algorithm/iri_base_algorithm.h>
#include "compass_odom_alg.h"
#include <tf/transform_datatypes.h>
#include <tf/transform_broadcaster.h>
#include <nav_msgs/Odometry.h>
#include <iri_common_drivers_msgs/compass3axis.h>
#include <sensor_msgs/Imu.h>
#include "eventserver.h"
#include "eventexceptions.h"
Go to the source code of this file.
Classes | |
class | CompassOdomAlgNode |
IRI ROS Specific Algorithm Class. More... |