#include <Eigen/Dense>
#include <iri_base_algorithm/iri_base_algorithm.h>
#include "scans_2_odom_alg.h"
#include <tf/transform_datatypes.h>
#include <sensor_msgs/LaserScan.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <iri_poseslam/GetLink.h>
#include <iri_laser_icp/GetRelativePose.h>
Go to the source code of this file.
Classes | |
class | Scans2OdomAlgNode |
IRI ROS Specific Algorithm Class. More... |