#include <iostream>#include <fstream>#include <chrono>#include <algorithm>#include <iterator>#include <pcl/point_types.h>#include <sensor_msgs/PointCloud2.h>#include <pcl_conversions/pcl_conversions.h>#include <tf/transform_listener.h>#include "pcl_ros/transforms.h"#include <ros/ros.h>#include <pcl_ros/point_cloud.h>#include <visualization_msgs/Marker.h>#include <geometry_msgs/Pose.h>#include <tf/transform_broadcaster.h>#include "laser_geometry/laser_geometry.h"
Go to the source code of this file.
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ > | PointCloud |
Functions | |
| void | hokuyo_callbacks (const sensor_msgs::LaserScan::ConstPtr &scan_in) |
| int | main (int argc, char **argv) |
Variables | |
| ros::Publisher | pcl_from_scan |
| laser_geometry::LaserProjection | projector |
| typedef pcl::PointCloud<pcl::PointXYZ> PointCloud |
Definition at line 26 of file scan_to_pcl.cpp.
| void hokuyo_callbacks | ( | const sensor_msgs::LaserScan::ConstPtr & | scan_in | ) |
Definition at line 29 of file scan_to_pcl.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 40 of file scan_to_pcl.cpp.
Definition at line 24 of file scan_to_pcl.cpp.
Definition at line 27 of file scan_to_pcl.cpp.