#include <algorithm>#include <ros/ros.h>#include <geometry_msgs/Polygon.h>#include <sensor_msgs/LaserScan.h>#include <sensor_msgs/PointCloud.h>#include <nav_msgs/OccupancyGrid.h>#include <laser_geometry/laser_geometry.h>#include <lama_common/place_profile_utils.h>#include <lama_msgs/PlaceProfile.h>#include <map_ray_caster/map_ray_caster.h>

Go to the source code of this file.
Namespaces | |
| namespace | lama_common |
Functions | |
| int32_t | lama_common::circular_index (int32_t index, size_t size) |
| PlaceProfile | lama_common::costmapToPlaceProfile (const nav_msgs::OccupancyGrid &map, double range_cutoff=0) |
| PlaceProfile | lama_common::laserScanToPlaceProfile (const sensor_msgs::LaserScan &scan, double range_cutoff) |
| sensor_msgs::PointCloud | lama_common::placeProfileToPointCloud (const PlaceProfile &profile) |
| geometry_msgs::Polygon | lama_common::placeProfileToPolygon (const PlaceProfile &profile) |