EasyNav Costmap Stack
Loading...
Searching...
No Matches
CostmapTest Member List

This is the complete list of members for CostmapTest, including all inherited members.

cellDistance(double world_dist)Costmap2D
convexFillCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)Costmap2D
copyCostmapWindow(const Costmap2D &map, double win_origin_x, double win_origin_y, double win_size_x, double win_size_y)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)Costmap2Dprotected
copyWindow(const Costmap2D &source, unsigned int sx0, unsigned int sy0, unsigned int sxn, unsigned int syn, unsigned int dx0, unsigned int dy0)Costmap2D
Costmap2D(unsigned int cells_size_x, unsigned int cells_size_y, double resolution, double origin_x, double origin_y, unsigned char default_value=0)Costmap2D
Costmap2D(const Costmap2D &map)Costmap2D
Costmap2D(const nav_msgs::msg::OccupancyGrid &map)Costmap2Dexplicit
Costmap2D()Costmap2D
costmap_Costmap2Dprotected
CostmapTest(unsigned int size_x, unsigned int size_y, double resolution, double origin_x, double origin_y, unsigned char default_val=0)CostmapTest
default_value_Costmap2Dprotected
deleteMaps()Costmap2Dprotectedvirtual
getCharMap() constCostmap2D
getCost(unsigned int mx, unsigned int my) constCostmap2D
getCost(unsigned int index) constCostmap2D
getCostmap()CostmapTest
getDefaultValue()Costmap2D
getIndex(unsigned int mx, unsigned int my) constCostmap2D
getMapRegionOccupiedByPolygon(const std::vector< geometry_msgs::msg::Point > &polygon, std::vector< MapLocation > &polygon_map_region)Costmap2D
getMutex()Costmap2D
getOriginX() constCostmap2D
getOriginY() constCostmap2D
getResolution() constCostmap2D
getSize()CostmapTest
getSizeInCellsX() constCostmap2D
getSizeInCellsY() constCostmap2D
getSizeInMetersX() constCostmap2D
getSizeInMetersY() constCostmap2D
inBounds(unsigned int x, unsigned int y) constCostmap2D
indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) constCostmap2D
initMaps(unsigned int size_x, unsigned int size_y)Costmap2Dprotectedvirtual
mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) constCostmap2D
mapToWorldNoBounds(int mx, int my, double &wx, double &wy) constCostmap2D
mutex_t typedefCostmap2D
operator=(const Costmap2D &map)Costmap2D
origin_x_Costmap2Dprotected
origin_y_Costmap2Dprotected
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)Costmap2D
raytraceLine(CostmapAction ca, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX, unsigned int min_length=0)CostmapTest
easynav::Costmap2D::raytraceLine(ActionType at, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX, unsigned int min_length=0)Costmap2Dprotected
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn)Costmap2D
resetMaps()Costmap2Dprotectedvirtual
resetMapToValue(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn, unsigned char value)Costmap2D
resizeMap(unsigned int size_x, unsigned int size_y, double resolution, double origin_x, double origin_y)Costmap2D
resolution_Costmap2Dprotected
restoreMapRegionOccupiedByPolygon(const std::vector< MapLocation > &polygon_map_region)Costmap2D
setConvexPolygonCost(const std::vector< geometry_msgs::msg::Point > &polygon, unsigned char cost_value)Costmap2D
setCost(unsigned int mx, unsigned int my, unsigned char cost)Costmap2D
setDefaultValue(unsigned char c)Costmap2D
setMapRegionOccupiedByPolygon(const std::vector< MapLocation > &polygon_map_region, unsigned char new_cost_value)Costmap2D
size_x_Costmap2Dprotected
size_y_Costmap2Dprotected
toOccupancyGridMsg(nav_msgs::msg::OccupancyGrid &msg) constCostmap2D
updateOrigin(double new_origin_x, double new_origin_y)Costmap2Dvirtual
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) constCostmap2D
worldToMapContinuous(double wx, double wy, float &mx, float &my) constCostmap2D
worldToMapEnforceBounds(double wx, double wy, int &mx, int &my) constCostmap2D
worldToMapNoBounds(double wx, double wy, int &mx, int &my) constCostmap2D
~Costmap2D()Costmap2Dvirtual