costmap_2d::FetchDepthLayer Member List

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

activate()costmap_2d::ObstacleLayervirtual
addExtraBounds(double mx0, double my0, double mx1, double my1)costmap_2d::CostmapLayer
addStaticObservation(costmap_2d::Observation &obs, bool marking, bool clearing)costmap_2d::ObstacleLayer
camera_info_sub_costmap_2d::FetchDepthLayerprivate
cameraInfoCallback(const sensor_msgs::CameraInfo::ConstPtr &msg)costmap_2d::FetchDepthLayerprivate
cellDistance(double world_dist)costmap_2d::Costmap2D
clear_nans_costmap_2d::FetchDepthLayerprivate
clear_with_skipped_rays_costmap_2d::FetchDepthLayerprivate
clearArea(int start_x, int start_y, int end_x, int end_y)costmap_2d::CostmapLayervirtual
clearing_buf_costmap_2d::FetchDepthLayerprivate
clearing_buffers_costmap_2d::ObstacleLayerprotected
clearing_pub_costmap_2d::FetchDepthLayerprivate
clearStaticObservations(bool marking, bool clearing)costmap_2d::ObstacleLayer
combination_method_costmap_2d::ObstacleLayerprotected
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
CostmapLayer()costmap_2d::CostmapLayer
current_costmap_2d::Layerprotected
deactivate()costmap_2d::ObstacleLayervirtual
default_value_costmap_2d::Costmap2Dprotected
deleteMaps()costmap_2d::Costmap2Dprotectedvirtual
depth_cleaner_costmap_2d::FetchDepthLayerprivate
depth_image_filter_costmap_2d::FetchDepthLayerprivate
depth_image_sub_costmap_2d::FetchDepthLayerprivate
depthImageCallback(const sensor_msgs::Image::ConstPtr &msg)costmap_2d::FetchDepthLayerprivate
dsrv_costmap_2d::ObstacleLayerprotected
enabled_costmap_2d::Layerprotected
FetchDepthLayer()costmap_2d::FetchDepthLayer
find_ground_plane_costmap_2d::FetchDepthLayerprivate
footprint_clearing_enabled_costmap_2d::ObstacleLayerprotected
getCharMap() constcostmap_2d::Costmap2D
getClearingObservations(std::vector< costmap_2d::Observation > &clearing_observations) constcostmap_2d::ObstacleLayerprotected
getCost(unsigned int mx, unsigned int my) constcostmap_2d::Costmap2D
getDefaultValue()costmap_2d::Costmap2D
getFootprint() constcostmap_2d::Layer
getIndex(unsigned int mx, unsigned int my) constcostmap_2d::Costmap2D
getMarkingObservations(std::vector< costmap_2d::Observation > &marking_observations) constcostmap_2d::ObstacleLayerprotected
getMutex()costmap_2d::Costmap2D
getName() constcostmap_2d::Layer
getOriginX() constcostmap_2d::Costmap2D
getOriginY() constcostmap_2d::Costmap2D
getResolution() constcostmap_2d::Costmap2D
getSizeInCellsX() constcostmap_2d::Costmap2D
getSizeInCellsY() constcostmap_2d::Costmap2D
getSizeInMetersX() constcostmap_2d::Costmap2D
getSizeInMetersY() constcostmap_2d::Costmap2D
global_frame_costmap_2d::ObstacleLayerprotected
ground_threshold_costmap_2d::FetchDepthLayerprivate
has_extra_bounds_costmap_2d::CostmapLayerprotected
indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) constcostmap_2d::Costmap2D
initialize(LayeredCostmap *parent, std::string name, tf2_ros::Buffer *tf)costmap_2d::Layer
initMaps(unsigned int size_x, unsigned int size_y)costmap_2d::Costmap2Dprotectedvirtual
isCurrent() constcostmap_2d::Layer
isDiscretized()costmap_2d::VoxelLayer
K_costmap_2d::FetchDepthLayerprivate
laserScanCallback(const sensor_msgs::LaserScanConstPtr &message, const boost::shared_ptr< costmap_2d::ObservationBuffer > &buffer)costmap_2d::ObstacleLayer
laserScanValidInfCallback(const sensor_msgs::LaserScanConstPtr &message, const boost::shared_ptr< ObservationBuffer > &buffer)costmap_2d::ObstacleLayer
Layer()costmap_2d::Layer
layered_costmap_costmap_2d::Layerprotected
mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) constcostmap_2d::Costmap2D
marking_buf_costmap_2d::FetchDepthLayerprivate
marking_buffers_costmap_2d::ObstacleLayerprotected
marking_pub_costmap_2d::FetchDepthLayerprivate
matchSize()costmap_2d::VoxelLayervirtual
max_obstacle_height_costmap_2d::ObstacleLayerprotected
mutex_K_costmap_2d::FetchDepthLayerprivate
mutex_t typedefcostmap_2d::Costmap2D
name_costmap_2d::Layerprotected
normals_estimator_costmap_2d::FetchDepthLayerprivate
observation_buffers_costmap_2d::ObstacleLayerprotected
observation_notifiers_costmap_2d::ObstacleLayerprotected
observation_subscribers_costmap_2d::ObstacleLayerprotected
observations_threshold_costmap_2d::FetchDepthLayerprivate
ObstacleLayer()costmap_2d::ObstacleLayer
onFootprintChanged()costmap_2d::Layervirtual
onInitialize()costmap_2d::FetchDepthLayervirtual
operator=(const Costmap2D &map)costmap_2d::Costmap2D
origin_x_costmap_2d::Costmap2Dprotected
origin_y_costmap_2d::Costmap2Dprotected
plane_estimator_costmap_2d::FetchDepthLayerprivate
pointCloud2Callback(const sensor_msgs::PointCloud2ConstPtr &message, const boost::shared_ptr< costmap_2d::ObservationBuffer > &buffer)costmap_2d::ObstacleLayer
pointCloudCallback(const sensor_msgs::PointCloudConstPtr &message, const boost::shared_ptr< costmap_2d::ObservationBuffer > &buffer)costmap_2d::ObstacleLayer
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)costmap_2d::Costmap2D
projector_costmap_2d::ObstacleLayerprotected
publish_observations_costmap_2d::FetchDepthLayerprivate
raytraceLine(ActionType at, unsigned int x0, unsigned int y0, unsigned int x1, unsigned int y1, unsigned int max_length=UINT_MAX)costmap_2d::Costmap2Dprotected
reset()costmap_2d::VoxelLayervirtual
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn)costmap_2d::Costmap2D
resetMaps()costmap_2d::VoxelLayerprotectedvirtual
resizeMap(unsigned int size_x, unsigned int size_y, double resolution, double origin_x, double origin_y)costmap_2d::Costmap2D
resolution_costmap_2d::Costmap2Dprotected
rolling_window_costmap_2d::ObstacleLayerprotected
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
setupDynamicReconfigure(ros::NodeHandle &nh)costmap_2d::VoxelLayerprotectedvirtual
size_x_costmap_2d::Costmap2Dprotected
size_y_costmap_2d::Costmap2Dprotected
skip_rays_bottom_costmap_2d::FetchDepthLayerprivate
skip_rays_left_costmap_2d::FetchDepthLayerprivate
skip_rays_right_costmap_2d::FetchDepthLayerprivate
skip_rays_top_costmap_2d::FetchDepthLayerprivate
static_clearing_observations_costmap_2d::ObstacleLayerprotected
static_marking_observations_costmap_2d::ObstacleLayerprotected
tf_costmap_2d::Layerprotected
touch(double x, double y, double *min_x, double *min_y, double *max_x, double *max_y)costmap_2d::CostmapLayerprotected
transformed_footprint_costmap_2d::ObstacleLayerprotected
updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y)costmap_2d::VoxelLayervirtual
updateCosts(costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)costmap_2d::ObstacleLayervirtual
updateFootprint(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y)costmap_2d::ObstacleLayerprotected
updateOrigin(double new_origin_x, double new_origin_y)costmap_2d::VoxelLayervirtual
updateRaytraceBounds(double ox, double oy, double wx, double wy, double range, double *min_x, double *min_y, double *max_x, double *max_y)costmap_2d::ObstacleLayerprotected
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
VoxelLayer()costmap_2d::VoxelLayer
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) constcostmap_2d::Costmap2D
worldToMapEnforceBounds(double wx, double wy, int &mx, int &my) constcostmap_2d::Costmap2D
worldToMapNoBounds(double wx, double wy, int &mx, int &my) constcostmap_2d::Costmap2D
~Costmap2D()costmap_2d::Costmap2Dvirtual
~FetchDepthLayer()costmap_2d::FetchDepthLayervirtual
~Layer()costmap_2d::Layervirtual
~ObstacleLayer()costmap_2d::ObstacleLayervirtual
~VoxelLayer()costmap_2d::VoxelLayervirtual


fetch_depth_layer
Author(s): Michael Ferguson
autogenerated on Mon Feb 28 2022 22:23:51