#include <ndt_visualisation/ndt_viz.h>#include <ros/ros.h>#include <tf/transform_listener.h>#include <boost/foreach.hpp>#include <sensor_msgs/LaserScan.h>#include <message_filters/subscriber.h>#include <message_filters/sync_policies/approximate_time.h>#include <nav_msgs/Odometry.h>#include <nav_msgs/OccupancyGrid.h>#include <visualization_msgs/MarkerArray.h>#include <tf/transform_broadcaster.h>#include "geometry_msgs/PoseWithCovarianceStamped.h"#include "geometry_msgs/Pose.h"#include <pcl_conversions/pcl_conversions.h>#include "tf/message_filter.h"#include <tf_conversions/tf_eigen.h>#include <message_filters/synchronizer.h>#include <geometry_msgs/PoseStamped.h>#include "sensor_msgs/PointCloud2.h"#include "ndt_mcl/3d_ndt_mcl.h"#include <ndt_map/ndt_map.h>
Go to the source code of this file.
Classes | |
| class | NDTMCL3DNode |
Defines | |
| #define | SYNC_FRAMES 20 |
Typedefs | |
| typedef message_filters::sync_policies::ApproximateTime < sensor_msgs::PointCloud2, nav_msgs::Odometry > | PointsOdomSync |
Functions | |
| int | main (int argc, char **argv) |
| #define SYNC_FRAMES 20 |
3D NDT-MCL Node. This application runs the ndt-mcl localization based on a map and laser scanner and odometry.
The initialization is based now on ground truth pose information (should be replaced with manual input).
The visualization depends on mrpt-gui
More details about the algorithm: Jari Saarinen, Henrik Andreasson, Todor Stoyanov and Achim J. Lilienthal, Normal Distributions Transform Monte-Carlo Localization (NDT-MCL) IEEE/RSJ International Conference on Intelligent Robots and Systems November 3-8, 2013, Tokyo Big Sight, Japan
Definition at line 51 of file 3d_ndt_mcl_node.cpp.
| typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::PointCloud2, nav_msgs::Odometry> PointsOdomSync |
Definition at line 53 of file 3d_ndt_mcl_node.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 332 of file 3d_ndt_mcl_node.cpp.