Go to the documentation of this file.
38 #ifndef LASER_SCAN_MATCHER_LASER_SCAN_MATCHER_H
39 #define LASER_SCAN_MATCHER_LASER_SCAN_MATCHER_H
42 #include <sensor_msgs/Imu.h>
43 #include <sensor_msgs/LaserScan.h>
44 #include <geometry_msgs/PoseStamped.h>
45 #include <geometry_msgs/Pose2D.h>
46 #include <geometry_msgs/PoseWithCovarianceStamped.h>
47 #include <geometry_msgs/PoseWithCovariance.h>
48 #include <geometry_msgs/TwistStamped.h>
49 #include <nav_msgs/Odometry.h>
53 #include <pcl/point_types.h>
54 #include <pcl/point_cloud.h>
55 #include <pcl/filters/voxel_grid.h>
167 void laserScanToLDP(
const sensor_msgs::LaserScan::ConstPtr& scan_msg,
172 void scanCallback (
const sensor_msgs::LaserScan::ConstPtr& scan_msg);
175 void odomCallback(
const nav_msgs::Odometry::ConstPtr& odom_msg);
176 void imuCallback (
const sensor_msgs::Imu::ConstPtr& imu_msg);
177 void velCallback (
const geometry_msgs::Twist::ConstPtr& twist_msg);
178 void velStmpCallback(
const geometry_msgs::TwistStamped::ConstPtr& twist_msg);
180 void createCache (
const sensor_msgs::LaserScan::ConstPtr& scan_msg);
202 #endif // LASER_SCAN_MATCHER_LASER_SCAN_MATCHER_H
laser_scan_matcher
Author(s): Ivan Dryanovski
, William Morris, Andrea Censi
autogenerated on Thu Oct 19 2023 02:48:35