Costmap layer for representing moveable furniture. More...
#include <carl_navigation/BlockedCells.h>
#include <costmap_2d/layer.h>
#include <costmap_2d/layered_costmap.h>
#include <costmap_2d/GenericPluginConfig.h>
#include <dynamic_reconfigure/server.h>
#include <nav_msgs/OccupancyGrid.h>
#include <ros/ros.h>
#include <rail_ceiling/GetAllObstacles.h>
#include <rail_ceiling/Obstacles.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
Classes | |
class | furniture_layer_namespace::FurnitureLayer |
class | furniture_layer_namespace::FurnitureLayerLocal |
Namespaces | |
namespace | furniture_layer_namespace |
Costmap layer for representing moveable furniture.
Furniture includes both a navigation footprint for use in path planning, and a localization footprint that represents what will be seen on CARL's laser scan.
Definition in file furniture_layer.h.