costmap_2d::Costmap2D Member List
This is the complete list of members for costmap_2d::Costmap2D, including all inherited members.
bresenham2D(ActionType at, unsigned int abs_da, unsigned int abs_db, int error_b, int offset_a, int offset_b, unsigned int offset, unsigned int max_length)costmap_2d::Costmap2D [inline, private]
cached_costs_costmap_2d::Costmap2D [protected]
cached_distances_costmap_2d::Costmap2D [protected]
cell_circumscribed_radius_costmap_2d::Costmap2D [protected]
cell_inflation_radius_costmap_2d::Costmap2D [protected]
cell_inscribed_radius_costmap_2d::Costmap2D [protected]
cellDistance(double world_dist)costmap_2d::Costmap2D [protected]
circumscribed_cost_lb_costmap_2d::Costmap2D [protected]
circumscribed_radius_costmap_2d::Costmap2D [protected]
clearNonLethal(double wx, double wy, double w_size_x, double w_size_y, bool clear_no_info=false)costmap_2d::Costmap2D [virtual]
computeCaches()costmap_2d::Costmap2D [private]
computeCost(double distance) const costmap_2d::Costmap2D [inline]
configuration_mutex_costmap_2d::Costmap2D [private]
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
copyKernels(const Costmap2D &map, unsigned int cell_inflation_radius)costmap_2d::Costmap2D [protected]
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 [inline, protected]
costLookup(int mx, int my, int src_x, int src_y)costmap_2d::Costmap2D [inline, private]
Costmap2D(unsigned int cells_size_x, unsigned int cells_size_y, double resolution, double origin_x, double origin_y, double inscribed_radius=0.0, double circumscribed_radius=0.0, double inflation_radius=0.0, double max_obstacle_range=0.0, double max_obstacle_height=0.0, double max_raytrace_range=0.0, double weight=25.0, const std::vector< unsigned char > &static_data=std::vector< unsigned char >(0), unsigned char lethal_threshold=0, bool track_unknown_space=false, unsigned char unknown_cost_value=0)costmap_2d::Costmap2D
Costmap2D(const Costmap2D &map)costmap_2d::Costmap2D
Costmap2D()costmap_2d::Costmap2D
costmap_costmap_2d::Costmap2D [protected]
CostmapTester classcostmap_2d::Costmap2D [friend]
deleteKernels()costmap_2d::Costmap2D [protected]
deleteMaps()costmap_2d::Costmap2D [protected, virtual]
distanceLookup(int mx, int my, int src_x, int src_y)costmap_2d::Costmap2D [inline, private]
enqueue(unsigned int index, unsigned int mx, unsigned int my, unsigned int src_x, unsigned int src_y, std::priority_queue< CellData > &inflation_queue)costmap_2d::Costmap2D [inline, protected]
finishConfiguration(costmap_2d::Costmap2DConfig &config)costmap_2d::Costmap2D [virtual]
getCharMap() const costmap_2d::Costmap2D
getCircumscribedCost() const costmap_2d::Costmap2D [inline]
getCircumscribedRadius() const costmap_2d::Costmap2D [inline]
getCost(unsigned int mx, unsigned int my) const costmap_2d::Costmap2D
getIndex(unsigned int mx, unsigned int my) const costmap_2d::Costmap2D [inline]
getInflationRadius() const costmap_2d::Costmap2D [inline]
getInscribedRadius() const costmap_2d::Costmap2D [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
indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) const costmap_2d::Costmap2D [inline]
inflateObstacles(std::priority_queue< CellData > &inflation_queue)costmap_2d::Costmap2D [private]
inflation_queue_costmap_2d::Costmap2D [protected]
inflation_radius_costmap_2d::Costmap2D [protected]
initMaps(unsigned int size_x, unsigned int size_y)costmap_2d::Costmap2D [protected, virtual]
inscribed_radius_costmap_2d::Costmap2D [protected]
isCircumscribedCell(unsigned int x, unsigned int y) const costmap_2d::Costmap2D
lethal_threshold_costmap_2d::Costmap2D [protected]
mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const costmap_2d::Costmap2D
markers_costmap_2d::Costmap2D [protected]
max_obstacle_height_costmap_2d::Costmap2D [protected]
max_obstacle_range_costmap_2d::Costmap2D [protected]
max_raytrace_range_costmap_2d::Costmap2D [protected]
operator=(const Costmap2D &map)costmap_2d::Costmap2D
origin_x_costmap_2d::Costmap2D [protected]
origin_y_costmap_2d::Costmap2D [protected]
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)costmap_2d::Costmap2D
raytraceFreespace(const std::vector< Observation > &clearing_observations)costmap_2d::Costmap2D [private]
raytraceFreespace(const Observation &clearing_observation)costmap_2d::Costmap2D [private, virtual]
raytraceLine(ActionType at, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX)costmap_2d::Costmap2D [inline, private]
reconfigure(costmap_2d::Costmap2DConfig &config, const costmap_2d::Costmap2DConfig &last_config)costmap_2d::Costmap2D
reinflateWindow(double wx, double wy, double w_size_x, double w_size_y, bool clear=true)costmap_2d::Costmap2D
replaceFullMap(double win_origin_x, double win_origin_y, unsigned int data_size_x, unsigned int data_size_y, const std::vector< unsigned char > &static_data)costmap_2d::Costmap2D
replaceStaticMapWindow(double win_origin_x, double win_origin_y, unsigned int data_size_x, unsigned int data_size_y, const std::vector< unsigned char > &static_data)costmap_2d::Costmap2D [protected]
resetInflationWindow(double wx, double wy, double w_size_x, double w_size_y, std::priority_queue< CellData > &inflation_queue, bool clear=true)costmap_2d::Costmap2D [private]
resetMapOutsideWindow(double wx, double wy, double w_size_x, double w_size_y)costmap_2d::Costmap2D [virtual]
resetMaps()costmap_2d::Costmap2D [protected, virtual]
reshapeStaticMap(double win_origin_x, double win_origin_y, unsigned int data_size_x, unsigned int data_size_y, const std::vector< unsigned char > &static_data)costmap_2d::Costmap2D [protected]
resolution_costmap_2d::Costmap2D [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
sign(int x)costmap_2d::Costmap2D [inline, private]
size_x_costmap_2d::Costmap2D [protected]
size_y_costmap_2d::Costmap2D [protected]
static_map_costmap_2d::Costmap2D [protected]
track_unknown_space_costmap_2d::Costmap2D [protected]
unknown_cost_value_costmap_2d::Costmap2D [protected]
updateCellCost(unsigned int index, unsigned char cost)costmap_2d::Costmap2D [inline, private]
updateObstacles(const std::vector< Observation > &observations, std::priority_queue< CellData > &inflation_queue)costmap_2d::Costmap2D [private, virtual]
updateOrigin(double new_origin_x, double new_origin_y)costmap_2d::Costmap2D [virtual]
updateStaticMapWindow(double win_origin_x, double win_origin_y, unsigned int data_size_x, unsigned int data_size_y, const std::vector< unsigned char > &static_data)costmap_2d::Costmap2D
updateWorld(double robot_x, double robot_y, const std::vector< Observation > &observations, const std::vector< Observation > &clearing_observations)costmap_2d::Costmap2D
weight_costmap_2d::Costmap2D [protected]
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) const costmap_2d::Costmap2D
worldToMapNoBounds(double wx, double wy, int &mx, int &my) const costmap_2d::Costmap2D
~Costmap2D()costmap_2d::Costmap2D [virtual]


costmap_2d
Author(s): Eitan Marder-Eppstein
autogenerated on Sat Dec 28 2013 17:13:40