frontier_exploration::BoundedExploreLayer Member List

This is the complete list of members for frontier_exploration::BoundedExploreLayer, including all inherited members.

activate()costmap_2d::Layervirtual
BoundedExploreLayer()frontier_exploration::BoundedExploreLayer
cellDistance(double world_dist)costmap_2d::Costmap2D
configured_frontier_exploration::BoundedExploreLayerprivate
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::Costmap2Dprotected
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
current_costmap_2d::Layerprotected
deactivate()costmap_2d::Layervirtual
default_value_costmap_2d::Costmap2Dprotected
deleteMaps()costmap_2d::Costmap2Dprotectedvirtual
dsrv_frontier_exploration::BoundedExploreLayerprivate
enabled_costmap_2d::Layerprotected
frontier_cloud_pubfrontier_exploration::BoundedExploreLayerprivate
frontier_travel_point_frontier_exploration::BoundedExploreLayerprivate
frontierService_frontier_exploration::BoundedExploreLayerprivate
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
getMutex()costmap_2d::Costmap2D
getName() const costmap_2d::Layer
getNextFrontier(geometry_msgs::PoseStamped start_pose, geometry_msgs::PoseStamped &next_frontier)frontier_exploration::BoundedExploreLayerprotected
getNextFrontierService(frontier_exploration::GetNextFrontier::Request &req, frontier_exploration::GetNextFrontier::Response &res)frontier_exploration::BoundedExploreLayerprotected
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::Costmap2Dprotectedvirtual
isCurrent() const costmap_2d::Layer
isDiscretized()frontier_exploration::BoundedExploreLayerinline
Layer()costmap_2d::Layer
layered_costmap_costmap_2d::Layerprotected
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::BoundedExploreLayerprivate
marked_frontier_exploration::BoundedExploreLayerprivate
matchSize()frontier_exploration::BoundedExploreLayervirtual
mutex_t typedefcostmap_2d::Costmap2D
name_costmap_2d::Layerprotected
onFootprintChanged()costmap_2d::Layervirtual
onInitialize()frontier_exploration::BoundedExploreLayervirtual
operator=(const Costmap2D &map)costmap_2d::Costmap2D
origin_x_costmap_2d::Costmap2Dprotected
origin_y_costmap_2d::Costmap2Dprotected
polygon_frontier_exploration::BoundedExploreLayerprivate
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)costmap_2d::Costmap2D
polygonService_frontier_exploration::BoundedExploreLayerprivate
raytraceLine(ActionType at, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX)costmap_2d::Costmap2Dprotected
reconfigureCB(costmap_2d::GenericPluginConfig &config, uint32_t level)frontier_exploration::BoundedExploreLayerprivate
reset()frontier_exploration::BoundedExploreLayervirtual
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn)costmap_2d::Costmap2D
resetMaps()costmap_2d::Costmap2Dprotectedvirtual
resize_to_boundary_frontier_exploration::BoundedExploreLayerprivate
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::Costmap2D
size_x_costmap_2d::Costmap2Dprotected
size_y_costmap_2d::Costmap2Dprotected
tf_costmap_2d::Layerprotected
tf_listener_frontier_exploration::BoundedExploreLayerprivate
updateBoundaryPolygon(geometry_msgs::PolygonStamped polygon_stamped)frontier_exploration::BoundedExploreLayerprotected
updateBoundaryPolygonService(frontier_exploration::UpdateBoundaryPolygon::Request &req, frontier_exploration::UpdateBoundaryPolygon::Response &res)frontier_exploration::BoundedExploreLayerprotected
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::BoundedExploreLayervirtual
updateCosts(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)frontier_exploration::BoundedExploreLayervirtual
updateOrigin(double new_origin_x, double new_origin_y)costmap_2d::Costmap2Dvirtual
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::Costmap2Dvirtual
~Layer()costmap_2d::Layervirtual


frontier_exploration
Author(s): Paul Bovbel
autogenerated on Mon Jun 10 2019 13:25:00