#include <vector>
#include <list>
#include <cfloat>
#include <geometry_msgs/Point32.h>
#include <costmap_2d/observation.h>
#include <base_local_planner/world_model.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <voxel_grid/voxel_grid.h>
Go to the source code of this file.
Classes | |
class | base_local_planner::VoxelGridModel |
A class that implements the WorldModel interface to provide grid based collision checks for the trajectory controller using a 3D voxel grid. More... | |
Namespaces | |
namespace | base_local_planner |