Stores a scan from a planar laser that can be used to clear freespace. More...
#include <planar_laser_scan.h>
Public Member Functions | |
| PlanarLaserScan () | |
Public Attributes | |
| double | angle_increment |
| double | angle_max |
| double | angle_min |
| sensor_msgs::PointCloud | cloud |
| geometry_msgs::Point32 | origin |
Stores a scan from a planar laser that can be used to clear freespace.
Definition at line 48 of file planar_laser_scan.h.
| base_local_planner::PlanarLaserScan::PlanarLaserScan | ( | ) | [inline] |
Definition at line 50 of file planar_laser_scan.h.
Definition at line 53 of file planar_laser_scan.h.
Definition at line 53 of file planar_laser_scan.h.
Definition at line 53 of file planar_laser_scan.h.
| sensor_msgs::PointCloud base_local_planner::PlanarLaserScan::cloud |
Definition at line 52 of file planar_laser_scan.h.
| geometry_msgs::Point32 base_local_planner::PlanarLaserScan::origin |
Definition at line 51 of file planar_laser_scan.h.