costmap_2d::CostmapLayer Member List

This is the complete list of members for costmap_2d::CostmapLayer, including all inherited members.

activate()costmap_2d::Layerinlinevirtual
addExtraBounds(double mx0, double my0, double mx1, double my1)costmap_2d::CostmapLayer
cellDistance(double world_dist)costmap_2d::Costmap2D
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::Costmap2Dinlineprotected
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::Costmap2Dprotected
CostmapLayer()costmap_2d::CostmapLayerinline
current_costmap_2d::Layerprotected
deactivate()costmap_2d::Layerinlinevirtual
default_value_costmap_2d::Costmap2Dprotected
deleteMaps()costmap_2d::Costmap2Dprotectedvirtual
enabled_costmap_2d::Layerprotected
extra_max_x_costmap_2d::CostmapLayerprivate
extra_max_y_costmap_2d::CostmapLayerprivate
extra_min_x_costmap_2d::CostmapLayerprivate
extra_min_y_costmap_2d::CostmapLayerprivate
getCharMap() const costmap_2d::Costmap2D
getCost(unsigned int mx, unsigned int my) const costmap_2d::Costmap2D
getDefaultValue()costmap_2d::Costmap2Dinline
getFootprint() const costmap_2d::Layer
getIndex(unsigned int mx, unsigned int my) const costmap_2d::Costmap2Dinline
getMutex()costmap_2d::Costmap2Dinline
getName() const costmap_2d::Layerinline
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
has_extra_bounds_costmap_2d::CostmapLayerprotected
indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) const costmap_2d::Costmap2Dinline
initialize(LayeredCostmap *parent, std::string name, tf::TransformListener *tf)costmap_2d::Layer
initMaps(unsigned int size_x, unsigned int size_y)costmap_2d::Costmap2Dprotectedvirtual
isCurrent() const costmap_2d::Layerinline
isDiscretized()costmap_2d::CostmapLayerinline
Layer()costmap_2d::Layer
layered_costmap_costmap_2d::Layerprotected
mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const costmap_2d::Costmap2D
matchSize()costmap_2d::CostmapLayervirtual
mutex_t typedefcostmap_2d::Costmap2D
name_costmap_2d::Layerprotected
onFootprintChanged()costmap_2d::Layerinlinevirtual
onInitialize()costmap_2d::Layerinlineprotectedvirtual
operator=(const Costmap2D &map)costmap_2d::Costmap2D
origin_x_costmap_2d::Costmap2Dprotected
origin_y_costmap_2d::Costmap2Dprotected
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)costmap_2d::Costmap2D
raytraceLine(ActionType at, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX)costmap_2d::Costmap2Dinlineprotected
reset()costmap_2d::Layerinlinevirtual
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn)costmap_2d::Costmap2D
resetMaps()costmap_2d::Costmap2Dprotectedvirtual
resizeMap(unsigned int size_x, unsigned int size_y, double resolution, double origin_x, double origin_y)costmap_2d::Costmap2D
resolution_costmap_2d::Costmap2Dprotected
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::Costmap2Dinline
size_x_costmap_2d::Costmap2Dprotected
size_y_costmap_2d::Costmap2Dprotected
tf_costmap_2d::Layerprotected
touch(double x, double y, double *min_x, double *min_y, double *max_x, double *max_y)costmap_2d::CostmapLayerprotected
updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y)costmap_2d::Layerinlinevirtual
updateCosts(Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)costmap_2d::Layerinlinevirtual
updateOrigin(double new_origin_x, double new_origin_y)costmap_2d::Costmap2Dvirtual
updateWithAddition(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)costmap_2d::CostmapLayerprotected
updateWithMax(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)costmap_2d::CostmapLayerprotected
updateWithOverwrite(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)costmap_2d::CostmapLayerprotected
updateWithTrueOverwrite(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)costmap_2d::CostmapLayerprotected
useExtraBounds(double *min_x, double *min_y, double *max_x, double *max_y)costmap_2d::CostmapLayerprotected
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) const costmap_2d::Costmap2D
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
~Costmap2D()costmap_2d::Costmap2Dvirtual
~Layer()costmap_2d::Layerinlinevirtual


costmap_2d
Author(s): Eitan Marder-Eppstein, David V. Lu!!, Dave Hershberger, contradict@gmail.com
autogenerated on Sun Mar 3 2019 03:44:17