#include <lama_common/place_profile_conversions.h>
Go to the source code of this file.
Namespaces | |
| namespace | lama_common |
Defines | |
| #define | COSTMAP_DISCRETISATION_COUNT 360 |
| #define | OCCUPIED_THRESHOLD 60 |
Functions | |
| PlaceProfile | lama_common::costmapToPlaceProfile (const nav_msgs::OccupancyGrid &map, double range_cutoff=0) |
| bool | lama_common::firstNonFree (const nav_msgs::OccupancyGrid &map, double angle, double range_cutoff, geometry_msgs::Point32 &point) |
| 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) |
| bool | lama_common::pointOccupied (const nav_msgs::OccupancyGrid &map, const int index) |
| bool | lama_common::pointUnknown (const nav_msgs::OccupancyGrid &map, const int index) |
| #define COSTMAP_DISCRETISATION_COUNT 360 |
Definition at line 4 of file place_profile_conversions.cpp.
| #define OCCUPIED_THRESHOLD 60 |
Definition at line 3 of file place_profile_conversions.cpp.