#include <iri_base_algorithm/iri_base_algorithm.h>
#include "laser_localisation_alg.h"
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <sensor_msgs/LaserScan.h>
#include <iri_laser_localisation/DoEstimation.h>
#include <iri_laser_localisation/DoLocalisation.h>
#include <iri_laser_icp/GetRelativePose.h>
Go to the source code of this file.
Classes | |
class | LaserLocalisationAlgNode |
IRI ROS Specific Algorithm Class. More... |