#include <math.h>
#include <cmath>
#include <map>
#include <vector>
#include <angles/angles.h>
#include <nav_msgs/OccupancyGrid.h>
#include <sensor_msgs/LaserScan.h>
#include <lama_msgs/PlaceProfile.h>
#include <map_ray_caster/ray_caster_utils.h>
Go to the source code of this file.
Classes | |
class | map_ray_caster::MapRayCaster |
Namespaces | |
namespace | map_ray_caster |
Typedefs | |
typedef std::map< double, std::vector< size_t > > | map_ray_caster::RayLookup |