This is the complete list of members for costmap_2d::VoxelLayer, including all inherited members.
| activate() | costmap_2d::ObstacleLayer | virtual | 
| addExtraBounds(double mx0, double my0, double mx1, double my1) | costmap_2d::CostmapLayer | |
| addStaticObservation(costmap_2d::Observation &obs, bool marking, bool clearing) | costmap_2d::ObstacleLayer | |
| cellDistance(double world_dist) | costmap_2d::Costmap2D | |
| clearArea(int start_x, int start_y, int end_x, int end_y) | costmap_2d::CostmapLayer | virtual | 
| clearing_buffers_ | costmap_2d::ObstacleLayer | protected | 
| clearing_endpoints_ | costmap_2d::VoxelLayer | private | 
| clearing_endpoints_pub_ | costmap_2d::VoxelLayer | private | 
| clearNonLethal(double wx, double wy, double w_size_x, double w_size_y, bool clear_no_info) | costmap_2d::VoxelLayer | private | 
| clearStaticObservations(bool marking, bool clearing) | costmap_2d::ObstacleLayer | |
| combination_method_ | costmap_2d::ObstacleLayer | protected | 
| convexFillCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells) | costmap_2d::Costmap2D | |
| copyCostmapWindow(const Costmap2D &map, double win_origin_x, double win_origin_y, double win_size_x, double win_size_y) | costmap_2d::Costmap2D | |
| copyMapRegion(data_type *source_map, unsigned int sm_lower_left_x, unsigned int sm_lower_left_y, unsigned int sm_size_x, data_type *dest_map, unsigned int dm_lower_left_x, unsigned int dm_lower_left_y, unsigned int dm_size_x, unsigned int region_size_x, unsigned int region_size_y) | costmap_2d::Costmap2D | inlineprotected | 
| Costmap2D(unsigned int cells_size_x, unsigned int cells_size_y, double resolution, double origin_x, double origin_y, unsigned char default_value=0) | costmap_2d::Costmap2D | |
| Costmap2D(const Costmap2D &map) | costmap_2d::Costmap2D | |
| Costmap2D() | costmap_2d::Costmap2D | |
| costmap_ | costmap_2d::Costmap2D | protected | 
| CostmapLayer() | costmap_2d::CostmapLayer | inline | 
| current_ | costmap_2d::Layer | protected | 
| deactivate() | costmap_2d::ObstacleLayer | virtual | 
| default_value_ | costmap_2d::Costmap2D | protected | 
| deleteMaps() | costmap_2d::Costmap2D | protectedvirtual | 
| dist(double x0, double y0, double z0, double x1, double y1, double z1) | costmap_2d::VoxelLayer | inlineprivate | 
| dsrv_ | costmap_2d::ObstacleLayer | protected | 
| enabled_ | costmap_2d::Layer | protected | 
| footprint_clearing_enabled_ | costmap_2d::ObstacleLayer | protected | 
| getCharMap() const | costmap_2d::Costmap2D | |
| getClearingObservations(std::vector< costmap_2d::Observation > &clearing_observations) const | costmap_2d::ObstacleLayer | protected | 
| getCost(unsigned int mx, unsigned int my) const | costmap_2d::Costmap2D | |
| getDefaultValue() | costmap_2d::Costmap2D | inline | 
| getFootprint() const | costmap_2d::Layer | |
| getIndex(unsigned int mx, unsigned int my) const | costmap_2d::Costmap2D | inline | 
| getMarkingObservations(std::vector< costmap_2d::Observation > &marking_observations) const | costmap_2d::ObstacleLayer | protected | 
| getMutex() | costmap_2d::Costmap2D | inline | 
| getName() const | costmap_2d::Layer | inline | 
| getOriginX() const | costmap_2d::Costmap2D | |
| getOriginY() const | costmap_2d::Costmap2D | |
| getResolution() const | costmap_2d::Costmap2D | |
| getSizeInCellsX() const | costmap_2d::Costmap2D | |
| getSizeInCellsY() const | costmap_2d::Costmap2D | |
| getSizeInMetersX() const | costmap_2d::Costmap2D | |
| getSizeInMetersY() const | costmap_2d::Costmap2D | |
| global_frame_ | costmap_2d::ObstacleLayer | protected | 
| has_extra_bounds_ | costmap_2d::CostmapLayer | protected | 
| indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) const | costmap_2d::Costmap2D | inline | 
| initialize(LayeredCostmap *parent, std::string name, tf2_ros::Buffer *tf) | costmap_2d::Layer | |
| initMaps(unsigned int size_x, unsigned int size_y) | costmap_2d::Costmap2D | protectedvirtual | 
| isCurrent() const | costmap_2d::Layer | inline | 
| isDiscretized() | costmap_2d::VoxelLayer | inline | 
| laserScanCallback(const sensor_msgs::LaserScanConstPtr &message, const boost::shared_ptr< costmap_2d::ObservationBuffer > &buffer) | costmap_2d::ObstacleLayer | |
| laserScanValidInfCallback(const sensor_msgs::LaserScanConstPtr &message, const boost::shared_ptr< ObservationBuffer > &buffer) | costmap_2d::ObstacleLayer | |
| Layer() | costmap_2d::Layer | |
| layered_costmap_ | costmap_2d::Layer | protected | 
| mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const | costmap_2d::Costmap2D | |
| mapToWorld3D(unsigned int mx, unsigned int my, unsigned int mz, double &wx, double &wy, double &wz) | costmap_2d::VoxelLayer | inlineprivate | 
| mark_threshold_ | costmap_2d::VoxelLayer | private | 
| marking_buffers_ | costmap_2d::ObstacleLayer | protected | 
| matchSize() | costmap_2d::VoxelLayer | virtual | 
| max_obstacle_height_ | costmap_2d::ObstacleLayer | protected | 
| mutex_t typedef | costmap_2d::Costmap2D | |
| name_ | costmap_2d::Layer | protected | 
| observation_buffers_ | costmap_2d::ObstacleLayer | protected | 
| observation_notifiers_ | costmap_2d::ObstacleLayer | protected | 
| observation_subscribers_ | costmap_2d::ObstacleLayer | protected | 
| ObstacleLayer() | costmap_2d::ObstacleLayer | inline | 
| onFootprintChanged() | costmap_2d::Layer | inlinevirtual | 
| onInitialize() | costmap_2d::VoxelLayer | virtual | 
| operator=(const Costmap2D &map) | costmap_2d::Costmap2D | |
| origin_x_ | costmap_2d::Costmap2D | protected | 
| origin_y_ | costmap_2d::Costmap2D | protected | 
| origin_z_ | costmap_2d::VoxelLayer | private | 
| pointCloud2Callback(const sensor_msgs::PointCloud2ConstPtr &message, const boost::shared_ptr< costmap_2d::ObservationBuffer > &buffer) | costmap_2d::ObstacleLayer | |
| pointCloudCallback(const sensor_msgs::PointCloudConstPtr &message, const boost::shared_ptr< costmap_2d::ObservationBuffer > &buffer) | costmap_2d::ObstacleLayer | |
| polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells) | costmap_2d::Costmap2D | |
| projector_ | costmap_2d::ObstacleLayer | protected | 
| publish_voxel_ | costmap_2d::VoxelLayer | private | 
| raytraceFreespace(const costmap_2d::Observation &clearing_observation, double *min_x, double *min_y, double *max_x, double *max_y) | costmap_2d::VoxelLayer | privatevirtual | 
| raytraceLine(ActionType at, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX) | costmap_2d::Costmap2D | inlineprotected | 
| reconfigureCB(costmap_2d::VoxelPluginConfig &config, uint32_t level) | costmap_2d::VoxelLayer | private | 
| reset() | costmap_2d::VoxelLayer | virtual | 
| resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn) | costmap_2d::Costmap2D | |
| resetMaps() | costmap_2d::VoxelLayer | protectedvirtual | 
| resizeMap(unsigned int size_x, unsigned int size_y, double resolution, double origin_x, double origin_y) | costmap_2d::Costmap2D | |
| resolution_ | costmap_2d::Costmap2D | protected | 
| rolling_window_ | costmap_2d::ObstacleLayer | protected | 
| saveMap(std::string file_name) | costmap_2d::Costmap2D | |
| setConvexPolygonCost(const std::vector< geometry_msgs::Point > &polygon, unsigned char cost_value) | costmap_2d::Costmap2D | |
| setCost(unsigned int mx, unsigned int my, unsigned char cost) | costmap_2d::Costmap2D | |
| setDefaultValue(unsigned char c) | costmap_2d::Costmap2D | inline | 
| setupDynamicReconfigure(ros::NodeHandle &nh) | costmap_2d::VoxelLayer | protectedvirtual | 
| size_x_ | costmap_2d::Costmap2D | protected | 
| size_y_ | costmap_2d::Costmap2D | protected | 
| size_z_ | costmap_2d::VoxelLayer | private | 
| static_clearing_observations_ | costmap_2d::ObstacleLayer | protected | 
| static_marking_observations_ | costmap_2d::ObstacleLayer | protected | 
| tf_ | costmap_2d::Layer | protected | 
| touch(double x, double y, double *min_x, double *min_y, double *max_x, double *max_y) | costmap_2d::CostmapLayer | protected | 
| transformed_footprint_ | costmap_2d::ObstacleLayer | protected | 
| unknown_threshold_ | costmap_2d::VoxelLayer | private | 
| updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y) | costmap_2d::VoxelLayer | virtual | 
| updateCosts(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | costmap_2d::ObstacleLayer | virtual | 
| updateFootprint(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y) | costmap_2d::ObstacleLayer | protected | 
| updateOrigin(double new_origin_x, double new_origin_y) | costmap_2d::VoxelLayer | virtual | 
| updateRaytraceBounds(double ox, double oy, double wx, double wy, double range, double *min_x, double *min_y, double *max_x, double *max_y) | costmap_2d::ObstacleLayer | protected | 
| updateWithAddition(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | costmap_2d::CostmapLayer | protected | 
| updateWithMax(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | costmap_2d::CostmapLayer | protected | 
| updateWithOverwrite(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | costmap_2d::CostmapLayer | protected | 
| updateWithTrueOverwrite(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | costmap_2d::CostmapLayer | protected | 
| useExtraBounds(double *min_x, double *min_y, double *max_x, double *max_y) | costmap_2d::CostmapLayer | protected | 
| voxel_dsrv_ | costmap_2d::VoxelLayer | private | 
| voxel_grid_ | costmap_2d::VoxelLayer | private | 
| voxel_pub_ | costmap_2d::VoxelLayer | private | 
| VoxelLayer() | costmap_2d::VoxelLayer | inline | 
| worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) const | costmap_2d::Costmap2D | |
| worldToMap3D(double wx, double wy, double wz, unsigned int &mx, unsigned int &my, unsigned int &mz) | costmap_2d::VoxelLayer | inlineprivate | 
| worldToMap3DFloat(double wx, double wy, double wz, double &mx, double &my, double &mz) | costmap_2d::VoxelLayer | inlineprivate | 
| worldToMapEnforceBounds(double wx, double wy, int &mx, int &my) const | costmap_2d::Costmap2D | |
| worldToMapNoBounds(double wx, double wy, int &mx, int &my) const | costmap_2d::Costmap2D | |
| z_resolution_ | costmap_2d::VoxelLayer | private | 
| ~Costmap2D() | costmap_2d::Costmap2D | virtual | 
| ~Layer() | costmap_2d::Layer | inlinevirtual | 
| ~ObstacleLayer() | costmap_2d::ObstacleLayer | virtual | 
| ~VoxelLayer() | costmap_2d::VoxelLayer | virtual |