Interfaces for interpreting raw packets from the Robosense 3D LIDAR. More...
#include <ros/ros.h>#include <ros/package.h>#include <rslidar_msgs/rslidarPacket.h>#include <rslidar_msgs/rslidarScan.h>#include "std_msgs/String.h"#include <pcl/point_types.h>#include <pcl_ros/point_cloud.h>#include <pcl_ros/impl/transforms.hpp>#include <pcl_conversions/pcl_conversions.h>#include <stdio.h>

Go to the source code of this file.
Classes | |
| struct | rslidar_rawdata::raw_block |
| Raw rslidar data block. More... | |
| struct | rslidar_rawdata::raw_packet |
| Raw Rsldar packet. More... | |
| class | rslidar_rawdata::RawData |
| RSLIDAR data conversion class. More... | |
| union | rslidar_rawdata::two_bytes |
Namespaces | |
| rslidar_rawdata | |
Typedefs | |
| typedef struct rslidar_rawdata::raw_block | rslidar_rawdata::raw_block_t |
| Raw rslidar data block. More... | |
| typedef struct rslidar_rawdata::raw_packet | rslidar_rawdata::raw_packet_t |
| Raw Rsldar packet. More... | |
Interfaces for interpreting raw packets from the Robosense 3D LIDAR.
Definition in file rawdata.h.