#include <cmath>
#include <exception>
#include <string>
#include <vector>
#include <ros/ros.h>
#include <tf/tf.h>
#include <tf/transform_listener.h>
#include <tf/transform_broadcaster.h>
#include <angles/angles.h>
#include <sensor_msgs/LaserScan.h>
#include <nav_msgs/OccupancyGrid.h>
#include <map_ray_caster/map_ray_caster.h>
Go to the source code of this file.
Classes | |
class | local_map::MapBuilder |
Namespaces | |
namespace | local_map |
Functions | |
template<typename T > | |
void | local_map::moveAndCopyImage (int fill, int dx, int dy, unsigned int ncol, std::vector< T > &map) |
int | local_map::offsetFromRowColNoRangeCheck (int row, int col, size_t ncol) |