Nav2 Navigation Stack - kilted  kilted
ROS 2 Navigation Stack
nav2_costmap_2d::StaticLayer Member List

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

activate()nav2_costmap_2d::StaticLayervirtual
addExtraBounds(double mx0, double my0, double mx1, double my1)nav2_costmap_2d::CostmapLayer
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
clock_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
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::StaticLayervirtual
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
dyn_params_handler_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
dynamicParametersCallback(std::vector< rclcpp::Parameter > parameters)nav2_costmap_2d::StaticLayerprotected
enabled_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
footprint_clearing_enabled_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
getCharMap() constnav2_costmap_2d::Costmap2D
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
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
getParameters()nav2_costmap_2d::StaticLayerprotected
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
global_frame_nav2_costmap_2d::StaticLayerprotected
has_extra_bounds_ (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
has_updated_data_nav2_costmap_2d::StaticLayerprotected
hasParameter(const std::string &param_name)nav2_costmap_2d::Layer
height_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
incomingMap(const nav_msgs::msg::OccupancyGrid::SharedPtr new_map)nav2_costmap_2d::StaticLayerprotected
incomingUpdate(map_msgs::msg::OccupancyGridUpdate::ConstSharedPtr update)nav2_costmap_2d::StaticLayerprotected
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_util::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
interpretValue(unsigned char value)nav2_costmap_2d::StaticLayerprotected
isClearable()nav2_costmap_2d::StaticLayerinlinevirtual
isCurrent() constnav2_costmap_2d::Layerinline
isDiscretized()nav2_costmap_2d::CostmapLayerinline
isEnabled() constnav2_costmap_2d::Layerinline
joinWithParentNamespace(const std::string &topic)nav2_costmap_2d::Layer
Layer()nav2_costmap_2d::Layer
layered_costmap_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
lethal_threshold_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
local_params_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
logger_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
map_buffer_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
map_frame_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
map_received_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
map_received_in_update_bounds_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
map_sub_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
map_subscribe_transient_local_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
map_topic_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
map_update_sub_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) constnav2_costmap_2d::Costmap2D
mapToWorldNoBounds(int mx, int my, double &wx, double &wy) constnav2_costmap_2d::Costmap2D
matchSize()nav2_costmap_2d::StaticLayervirtual
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
onFootprintChanged()nav2_costmap_2d::Layerinlinevirtual
onInitialize()nav2_costmap_2d::StaticLayervirtual
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
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)nav2_costmap_2d::Costmap2D
processMap(const nav_msgs::msg::OccupancyGrid &new_map)nav2_costmap_2d::StaticLayerprotected
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::StaticLayervirtual
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn)nav2_costmap_2d::Costmap2D
resetMaps()nav2_costmap_2d::Costmap2Dprotectedvirtual
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
restore_cleared_footprint_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
restoreMapRegionOccupiedByPolygon(const std::vector< MapLocation > &polygon_map_region)nav2_costmap_2d::Costmap2D
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
StaticLayer()nav2_costmap_2d::StaticLayer
subscribe_to_updates_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
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
track_unknown_space_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
transform_tolerance_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
transformed_footprint_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
trinary_costmap_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
unknown_cost_value_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
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::StaticLayervirtual
updateCosts(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)nav2_costmap_2d::StaticLayervirtual
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::StaticLayerprotected
updateOrigin(double new_origin_x, double new_origin_y)nav2_costmap_2d::Costmap2Dvirtual
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
use_maximum_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
useExtraBounds(double *min_x, double *min_y, double *max_x, double *max_y) (defined in nav2_costmap_2d::CostmapLayer)nav2_costmap_2d::CostmapLayerprotected
width_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) constnav2_costmap_2d::Costmap2D
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
x_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
y_ (defined in nav2_costmap_2d::StaticLayer)nav2_costmap_2d::StaticLayerprotected
~Costmap2D()nav2_costmap_2d::Costmap2Dvirtual
~Layer()nav2_costmap_2d::Layerinlinevirtual
~StaticLayer()nav2_costmap_2d::StaticLayervirtual