, including all inherited members.
activate() | costmap_2d::Layer | [virtual] |
BoundedExploreLayer() | frontier_exploration::BoundedExploreLayer | |
cellDistance(double world_dist) | costmap_2d::Costmap2D | |
configured_ | frontier_exploration::BoundedExploreLayer | [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 | |
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 | [protected] |
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] |
current_ | costmap_2d::Layer | [protected] |
deactivate() | costmap_2d::Layer | [virtual] |
default_value_ | costmap_2d::Costmap2D | [protected] |
deleteMaps() | costmap_2d::Costmap2D | [protected, virtual] |
dsrv_ | frontier_exploration::BoundedExploreLayer | [private] |
enabled_ | costmap_2d::Layer | [protected] |
frontier_cloud_pub | frontier_exploration::BoundedExploreLayer | [private] |
frontier_travel_point_ | frontier_exploration::BoundedExploreLayer | [private] |
frontierService_ | frontier_exploration::BoundedExploreLayer | [private] |
getCharMap() const | costmap_2d::Costmap2D | |
getCost(unsigned int mx, unsigned int my) const | costmap_2d::Costmap2D | |
getDefaultValue() | costmap_2d::Costmap2D | |
getFootprint() const | costmap_2d::Layer | |
getIndex(unsigned int mx, unsigned int my) const | costmap_2d::Costmap2D | |
getLock() | costmap_2d::Costmap2D | |
getName() const | costmap_2d::Layer | |
getNextFrontier(geometry_msgs::PoseStamped start_pose, geometry_msgs::PoseStamped &next_frontier) | frontier_exploration::BoundedExploreLayer | [protected] |
getNextFrontierService(frontier_exploration::GetNextFrontier::Request &req, frontier_exploration::GetNextFrontier::Response &res) | frontier_exploration::BoundedExploreLayer | [protected] |
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 | |
initialize(LayeredCostmap *parent, std::string name, tf::TransformListener *tf) | costmap_2d::Layer | |
initMaps(unsigned int size_x, unsigned int size_y) | costmap_2d::Costmap2D | [protected, virtual] |
isCurrent() const | costmap_2d::Layer | |
isDiscretized() | frontier_exploration::BoundedExploreLayer | [inline] |
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 | |
mapUpdateKeepObstacles(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | frontier_exploration::BoundedExploreLayer | [private] |
marked_ | frontier_exploration::BoundedExploreLayer | [private] |
matchSize() | frontier_exploration::BoundedExploreLayer | [virtual] |
name_ | costmap_2d::Layer | [protected] |
onFootprintChanged() | costmap_2d::Layer | [virtual] |
onInitialize() | frontier_exploration::BoundedExploreLayer | [virtual] |
operator=(const Costmap2D &map) | costmap_2d::Costmap2D | |
origin_x_ | costmap_2d::Costmap2D | [protected] |
origin_y_ | costmap_2d::Costmap2D | [protected] |
polygon_ | frontier_exploration::BoundedExploreLayer | [private] |
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells) | costmap_2d::Costmap2D | |
polygonService_ | frontier_exploration::BoundedExploreLayer | [private] |
raytraceLine(ActionType at, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX) | costmap_2d::Costmap2D | [protected] |
reconfigureCB(costmap_2d::GenericPluginConfig &config, uint32_t level) | frontier_exploration::BoundedExploreLayer | [private] |
reset() | frontier_exploration::BoundedExploreLayer | [virtual] |
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn) | costmap_2d::Costmap2D | |
resetMaps() | costmap_2d::Costmap2D | [protected, virtual] |
resize_to_boundary_ | frontier_exploration::BoundedExploreLayer | [private] |
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] |
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 | |
size_x_ | costmap_2d::Costmap2D | [protected] |
size_y_ | costmap_2d::Costmap2D | [protected] |
tf_ | costmap_2d::Layer | [protected] |
tf_listener_ | frontier_exploration::BoundedExploreLayer | [private] |
updateBoundaryPolygon(geometry_msgs::PolygonStamped polygon_stamped) | frontier_exploration::BoundedExploreLayer | [protected] |
updateBoundaryPolygonService(frontier_exploration::UpdateBoundaryPolygon::Request &req, frontier_exploration::UpdateBoundaryPolygon::Response &res) | frontier_exploration::BoundedExploreLayer | [protected] |
updateBounds(double origin_x, double origin_y, double origin_yaw, double *polygon_min_x, double *polygon_min_y, double *polygon_max_x, double *polygon_max_y) | frontier_exploration::BoundedExploreLayer | [virtual] |
updateCosts(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | frontier_exploration::BoundedExploreLayer | [virtual] |
updateOrigin(double new_origin_x, double new_origin_y) | costmap_2d::Costmap2D | [virtual] |
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 | |
~BoundedExploreLayer() | frontier_exploration::BoundedExploreLayer | |
~Costmap2D() | costmap_2d::Costmap2D | [virtual] |
~Layer() | costmap_2d::Layer | [virtual] |