#include <ros/ros.h>#include <sensor_msgs/LaserScan.h>#include <dlut_pc_odom/motor.h>#include <std_msgs/Bool.h>#include <std_msgs/UInt32.h>#include <geometry_msgs/PointStamped.h>#include <geometry_msgs/Vector3.h>#include <iostream>#include <fstream>#include <math.h>#include <tf/transform_listener.h>#include <nav_msgs/Odometry.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include "pcl/io/pcd_io.h"
Go to the source code of this file.
Classes | |
| class | PointCloudOdom |
Defines | |
| #define | PAI 3.1415926 |
Typedefs | |
| typedef pcl::PointCloud < PointType > | PCLPointCloud |
| typedef pcl::PointXYZRGB | PointType |
Functions | |
| PCLPointCloud::Ptr | final (new PCLPointCloud) |
| int | main (int argc, char **argv) |
| #define PAI 3.1415926 |
Definition at line 53 of file odom_pc.cpp.
| typedef pcl::PointCloud<PointType> PCLPointCloud |
Definition at line 56 of file odom_pc.cpp.
| typedef pcl::PointXYZRGB PointType |
Definition at line 55 of file odom_pc.cpp.
| PCLPointCloud::Ptr final | ( | new | PCLPointCloud | ) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 389 of file odom_pc.cpp.