Nav2 Navigation Stack - rolling  main
ROS 2 Navigation Stack
nav2_costmap_2d::VoxelLayer Member List

This is the complete list of members for nav2_costmap_2d::VoxelLayer, including all inherited members.

activate()nav2_costmap_2d::ObstacleLayervirtual
addExtraBounds(double mx0, double my0, double mx1, double my1)nav2_costmap_2d::CostmapLayer
addStaticObservation(nav2_costmap_2d::Observation &obs, bool marking, bool clearing) (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayer
callback_group_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
cellDistance(double world_dist)nav2_costmap_2d::Costmap2D
clearArea(int start_x, int start_y, int end_x, int end_y, bool invert)nav2_costmap_2d::CostmapLayervirtual
clearing_buffers_nav2_costmap_2d::ObstacleLayerprotected
clearing_endpoints_pub_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
clearStaticObservations(bool marking, bool clearing) (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayer
clock_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
combination_method_ (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayerprotected
combination_method_from_int(const int value)nav2_costmap_2d::CostmapLayerprotected
convexFillCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)nav2_costmap_2d::Costmap2D
copyCostmapWindow(const Costmap2D &map, double win_origin_x, double win_origin_y, double win_size_x, double win_size_y)nav2_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)nav2_costmap_2d::Costmap2Dinlineprotected
copyWindow(const Costmap2D &source, unsigned int sx0, unsigned int sy0, unsigned int sxn, unsigned int syn, unsigned int dx0, unsigned int dy0)nav2_costmap_2d::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)nav2_costmap_2d::Costmap2D
Costmap2D(const Costmap2D &map)nav2_costmap_2d::Costmap2D
Costmap2D(const nav_msgs::msg::OccupancyGrid &map)nav2_costmap_2d::Costmap2Dexplicit
Costmap2D()nav2_costmap_2d::Costmap2D
costmap_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
CostmapLayer()nav2_costmap_2d::CostmapLayerinline
current_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
deactivate()nav2_costmap_2d::ObstacleLayervirtual
declareParameter(const std::string &param_name, const rclcpp::ParameterValue &value)nav2_costmap_2d::Layer
declareParameter(const std::string &param_name, const rclcpp::ParameterType &param_type)nav2_costmap_2d::Layer
default_value_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
deleteMaps()nav2_costmap_2d::Costmap2Dprotectedvirtual
dist(double x0, double y0, double z0, double x1, double y1, double z1)nav2_costmap_2d::VoxelLayerinlineprotected
dyn_params_handler_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
dynamicParametersCallback(std::vector< rclcpp::Parameter > parameters)nav2_costmap_2d::VoxelLayerprotected
enabled_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
footprint_clearing_enabled_ (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayerprotected
getCharMap() constnav2_costmap_2d::Costmap2D
getClearingObservations(std::vector< nav2_costmap_2d::Observation > &clearing_observations) constnav2_costmap_2d::ObstacleLayerprotected
getCost(unsigned int mx, unsigned int my) constnav2_costmap_2d::Costmap2D
getCost(unsigned int index) constnav2_costmap_2d::Costmap2D
getDefaultValue()nav2_costmap_2d::Costmap2Dinline
getFootprint() constnav2_costmap_2d::Layer
getFullName(const std::string &param_name)nav2_costmap_2d::Layer
getIndex(unsigned int mx, unsigned int my) constnav2_costmap_2d::Costmap2Dinline
getMapRegionOccupiedByPolygon(const std::vector< geometry_msgs::msg::Point > &polygon, std::vector< MapLocation > &polygon_map_region)nav2_costmap_2d::Costmap2D
getMarkingObservations(std::vector< nav2_costmap_2d::Observation > &marking_observations) constnav2_costmap_2d::ObstacleLayerprotected
getMutex() (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dinline
getName() constnav2_costmap_2d::Layerinline
getOriginX() constnav2_costmap_2d::Costmap2D
getOriginY() constnav2_costmap_2d::Costmap2D
getResolution() constnav2_costmap_2d::Costmap2D
getSizeInCellsX() constnav2_costmap_2d::Costmap2D
getSizeInCellsY() constnav2_costmap_2d::Costmap2D
getSizeInMetersX() constnav2_costmap_2d::Costmap2D
getSizeInMetersY() constnav2_costmap_2d::Costmap2D
getSizeInMetersZ() constnav2_costmap_2d::VoxelLayerinlineprotected
global_frame_nav2_costmap_2d::ObstacleLayerprotected
has_extra_bounds_ (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
hasParameter(const std::string &param_name)nav2_costmap_2d::Layer
indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) constnav2_costmap_2d::Costmap2Dinline
initialize(LayeredCostmap *parent, std::string name, tf2_ros::Buffer *tf, const nav2::LifecycleNode::WeakPtr &node, rclcpp::CallbackGroup::SharedPtr callback_group)nav2_costmap_2d::Layer
initMaps(unsigned int size_x, unsigned int size_y)nav2_costmap_2d::Costmap2Dprotectedvirtual
isClearable()nav2_costmap_2d::VoxelLayerinlinevirtual
isCurrent() constnav2_costmap_2d::Layerinline
isDiscretized()nav2_costmap_2d::VoxelLayerinline
isEnabled() constnav2_costmap_2d::Layerinline
joinWithParentNamespace(const std::string &topic)nav2_costmap_2d::Layer
laserScanCallback(sensor_msgs::msg::LaserScan::ConstSharedPtr message, const std::shared_ptr< nav2_costmap_2d::ObservationBuffer > &buffer)nav2_costmap_2d::ObstacleLayer
laserScanValidInfCallback(sensor_msgs::msg::LaserScan::ConstSharedPtr message, const std::shared_ptr< nav2_costmap_2d::ObservationBuffer > &buffer)nav2_costmap_2d::ObstacleLayer
Layer()nav2_costmap_2d::Layer
layered_costmap_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
local_params_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
logger_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) constnav2_costmap_2d::Costmap2D
mapToWorld3D(unsigned int mx, unsigned int my, unsigned int mz, double &wx, double &wy, double &wz)nav2_costmap_2d::VoxelLayerinlineprotected
mapToWorldNoBounds(int mx, int my, double &wx, double &wy) constnav2_costmap_2d::Costmap2D
mark_threshold_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
marking_buffers_nav2_costmap_2d::ObstacleLayerprotected
matchSize()nav2_costmap_2d::VoxelLayervirtual
max_obstacle_height_nav2_costmap_2d::ObstacleLayerprotected
min_obstacle_height_nav2_costmap_2d::ObstacleLayerprotected
mutex_t typedef (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2D
name_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
node_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
observation_buffers_nav2_costmap_2d::ObstacleLayerprotected
observation_notifiers_nav2_costmap_2d::ObstacleLayerprotected
observation_subscribers_nav2_costmap_2d::ObstacleLayerprotected
ObstacleLayer()nav2_costmap_2d::ObstacleLayerinline
onFootprintChanged()nav2_costmap_2d::Layerinlinevirtual
onInitialize()nav2_costmap_2d::VoxelLayervirtual
operator=(const Costmap2D &map)nav2_costmap_2d::Costmap2D
origin_x_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
origin_y_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
origin_z_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
pointCloud2Callback(sensor_msgs::msg::PointCloud2::ConstSharedPtr message, const std::shared_ptr< nav2_costmap_2d::ObservationBuffer > &buffer)nav2_costmap_2d::ObstacleLayer
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)nav2_costmap_2d::Costmap2D
projector_nav2_costmap_2d::ObstacleLayerprotected
publish_voxel_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
raytraceFreespace(const nav2_costmap_2d::Observation &clearing_observation, double *min_x, double *min_y, double *max_x, double *max_y)nav2_costmap_2d::VoxelLayerprotectedvirtual
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)nav2_costmap_2d::Costmap2Dinlineprotected
reset()nav2_costmap_2d::VoxelLayervirtual
resetBuffersLastUpdated()nav2_costmap_2d::ObstacleLayer
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn)nav2_costmap_2d::Costmap2D
resetMaps()nav2_costmap_2d::VoxelLayerprotectedvirtual
resetMapToValue(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn, unsigned char value)nav2_costmap_2d::Costmap2D
resizeMap(unsigned int size_x, unsigned int size_y, double resolution, double origin_x, double origin_y)nav2_costmap_2d::Costmap2D
resolution_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
restoreMapRegionOccupiedByPolygon(const std::vector< MapLocation > &polygon_map_region)nav2_costmap_2d::Costmap2D
rolling_window_ (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayerprotected
saveMap(std::string file_name)nav2_costmap_2d::Costmap2D
setConvexPolygonCost(const std::vector< geometry_msgs::msg::Point > &polygon, unsigned char cost_value)nav2_costmap_2d::Costmap2D
setCost(unsigned int mx, unsigned int my, unsigned char cost)nav2_costmap_2d::Costmap2D
setDefaultValue(unsigned char c)nav2_costmap_2d::Costmap2Dinline
setMapRegionOccupiedByPolygon(const std::vector< MapLocation > &polygon_map_region, unsigned char new_cost_value)nav2_costmap_2d::Costmap2D
size_x_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
size_y_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
size_z_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
static_clearing_observations_ (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayerprotected
static_marking_observations_ (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayerprotected
tf_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
touch(double x, double y, double *min_x, double *min_y, double *max_x, double *max_y)nav2_costmap_2d::CostmapLayerprotected
transformed_footprint_ (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayerprotected
unknown_threshold_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y)nav2_costmap_2d::VoxelLayervirtual
updateCosts(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)nav2_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)nav2_costmap_2d::ObstacleLayerprotected
updateOrigin(double new_origin_x, double new_origin_y)nav2_costmap_2d::VoxelLayervirtual
updateRaytraceBounds(double ox, double oy, double wx, double wy, double max_range, double min_range, double *min_x, double *min_y, double *max_x, double *max_y)nav2_costmap_2d::ObstacleLayerprotected
updateWithAddition(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
updateWithMax(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
updateWithMaxWithoutUnknownOverwrite(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
updateWithOverwrite(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
updateWithTrueOverwrite(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
useExtraBounds(double *min_x, double *min_y, double *max_x, double *max_y) (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
voxel_grid_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
voxel_pub_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
VoxelLayer()nav2_costmap_2d::VoxelLayerinline
was_reset_ (defined in nav2_costmap_2d::ObstacleLayer)nav2_costmap_2d::ObstacleLayerprotected
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) constnav2_costmap_2d::Costmap2D
worldToMap3D(double wx, double wy, double wz, unsigned int &mx, unsigned int &my, unsigned int &mz)nav2_costmap_2d::VoxelLayerinlineprotected
worldToMap3DFloat(double wx, double wy, double wz, double &mx, double &my, double &mz)nav2_costmap_2d::VoxelLayerinlineprotected
worldToMapContinuous(double wx, double wy, float &mx, float &my) constnav2_costmap_2d::Costmap2D
worldToMapEnforceBounds(double wx, double wy, int &mx, int &my) constnav2_costmap_2d::Costmap2D
worldToMapNoBounds(double wx, double wy, int &mx, int &my) constnav2_costmap_2d::Costmap2D
z_resolution_ (defined in nav2_costmap_2d::VoxelLayer)nav2_costmap_2d::VoxelLayerprotected
~Costmap2D()nav2_costmap_2d::Costmap2Dvirtual
~Layer()nav2_costmap_2d::Layerinlinevirtual
~ObstacleLayer()nav2_costmap_2d::ObstacleLayervirtual
~VoxelLayer()nav2_costmap_2d::VoxelLayervirtual