#include <algorithm>#include <map>#include <memory>#include <string>#include <utility>#include <vector>#include <boost/chrono.hpp>#include <boost/shared_ptr.hpp>#include <ros/ros.h>#include <sensor_msgs/PointCloud.h>#include <sensor_msgs/PointCloud2.h>#include <sensor_msgs/point_cloud_conversion.h>#include <nav_msgs/Odometry.h>#include <sensor_msgs/Imu.h>#include <geometry_msgs/PoseArray.h>#include <geometry_msgs/PoseWithCovarianceStamped.h>#include <geometry_msgs/TransformStamped.h>#include <visualization_msgs/MarkerArray.h>#include <mcl_3dl_msgs/ResizeParticle.h>#include <mcl_3dl_msgs/Status.h>#include <std_srvs/Trigger.h>#include <tf2_geometry_msgs/tf2_geometry_msgs.h>#include <tf2_ros/transform_broadcaster.h>#include <tf2_ros/transform_listener.h>#include <tf2_sensor_msgs/tf2_sensor_msgs.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/point_types.h>#include <pcl_ros/point_cloud.h>#include <pcl_ros/transforms.h>#include <pcl/conversions.h>#include <pcl/filters/voxel_grid.h>#include <pcl/kdtree/kdtree.h>#include <pcl/kdtree/kdtree_flann.h>#include <Eigen/Core>#include <pcl18_backports/voxel_grid.h>#include <mcl_3dl/chunked_kdtree.h>#include <mcl_3dl/filter.h>#include <mcl_3dl/imu_measurement_model_base.h>#include <mcl_3dl/imu_measurement_models/imu_measurement_model_gravity.h>#include <mcl_3dl/lidar_measurement_model_base.h>#include <mcl_3dl/lidar_measurement_models/lidar_measurement_model_beam.h>#include <mcl_3dl/lidar_measurement_models/lidar_measurement_model_likelihood.h>#include <mcl_3dl/motion_prediction_model_base.h>#include <mcl_3dl/motion_prediction_models/motion_prediction_model_differential_drive.h>#include <mcl_3dl/nd.h>#include <mcl_3dl/parameters.h>#include <mcl_3dl/pf.h>#include <mcl_3dl/point_conversion.h>#include <mcl_3dl/point_types.h>#include <mcl_3dl/quat.h>#include <mcl_3dl/raycast.h>#include <mcl_3dl/state_6dof.h>#include <mcl_3dl/vec3.h>#include <mcl_3dl_compat/compatibility.h>Go to the source code of this file.
Classes | |
| class | mcl_3dl::MCL3dlNode |
| class | mcl_3dl::MCL3dlNode::MyPointRepresentation |
Namespaces | |
| namespace | mcl_3dl |
Functions | |
| int | main (int argc, char *argv[]) |
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 1385 of file mcl_3dl.cpp.