Nav2 Navigation Stack - humble
humble
ROS 2 Navigation Stack
|
This is the complete list of members for nav2_costmap_2d::StaticLayer, including all inherited members.
activate() | nav2_costmap_2d::StaticLayer | virtual |
addExtraBounds(double mx0, double my0, double mx1, double my1) | nav2_costmap_2d::CostmapLayer | |
callback_group_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
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::CostmapLayer | virtual |
clock_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
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::Costmap2D | inlineprotected |
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::Costmap2D | explicit |
Costmap2D() | nav2_costmap_2d::Costmap2D | |
costmap_ (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | protected |
CostmapLayer() | nav2_costmap_2d::CostmapLayer | inline |
current_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
deactivate() | nav2_costmap_2d::StaticLayer | virtual |
declareParameter(const std::string ¶m_name, const rclcpp::ParameterValue &value) | nav2_costmap_2d::Layer | |
declareParameter(const std::string ¶m_name, const rclcpp::ParameterType ¶m_type) | nav2_costmap_2d::Layer | |
default_value_ (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | protected |
deleteMaps() | nav2_costmap_2d::Costmap2D | protectedvirtual |
dyn_params_handler_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
dynamicParametersCallback(std::vector< rclcpp::Parameter > parameters) | nav2_costmap_2d::StaticLayer | protected |
enabled_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
footprint_clearing_enabled_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
getCharMap() const | nav2_costmap_2d::Costmap2D | |
getCost(unsigned int mx, unsigned int my) const | nav2_costmap_2d::Costmap2D | |
getCost(unsigned int index) const | nav2_costmap_2d::Costmap2D | |
getDefaultValue() | nav2_costmap_2d::Costmap2D | inline |
getFootprint() const | nav2_costmap_2d::Layer | |
getFullName(const std::string ¶m_name) | nav2_costmap_2d::Layer | |
getIndex(unsigned int mx, unsigned int my) const | nav2_costmap_2d::Costmap2D | inline |
getMutex() (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | inline |
getName() const | nav2_costmap_2d::Layer | inline |
getOriginX() const | nav2_costmap_2d::Costmap2D | |
getOriginY() const | nav2_costmap_2d::Costmap2D | |
getParameters() | nav2_costmap_2d::StaticLayer | protected |
getResolution() const | nav2_costmap_2d::Costmap2D | |
getSizeInCellsX() const | nav2_costmap_2d::Costmap2D | |
getSizeInCellsY() const | nav2_costmap_2d::Costmap2D | |
getSizeInMetersX() const | nav2_costmap_2d::Costmap2D | |
getSizeInMetersY() const | nav2_costmap_2d::Costmap2D | |
global_frame_ | nav2_costmap_2d::StaticLayer | protected |
has_extra_bounds_ (defined in nav2_costmap_2d::CostmapLayer) | nav2_costmap_2d::CostmapLayer | protected |
has_updated_data_ | nav2_costmap_2d::StaticLayer | protected |
hasParameter(const std::string ¶m_name) | nav2_costmap_2d::Layer | |
height_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
incomingMap(const nav_msgs::msg::OccupancyGrid::SharedPtr new_map) | nav2_costmap_2d::StaticLayer | protected |
incomingUpdate(map_msgs::msg::OccupancyGridUpdate::ConstSharedPtr update) | nav2_costmap_2d::StaticLayer | protected |
indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) const | nav2_costmap_2d::Costmap2D | inline |
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::Costmap2D | protectedvirtual |
interpretValue(unsigned char value) | nav2_costmap_2d::StaticLayer | protected |
isClearable() | nav2_costmap_2d::StaticLayer | inlinevirtual |
isCurrent() const | nav2_costmap_2d::Layer | inline |
isDiscretized() | nav2_costmap_2d::CostmapLayer | inline |
isEnabled() const | nav2_costmap_2d::Layer | inline |
Layer() | nav2_costmap_2d::Layer | |
layered_costmap_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
lethal_threshold_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
local_params_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
logger_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
map_buffer_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
map_frame_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
map_received_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
map_received_in_update_bounds_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
map_sub_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
map_subscribe_transient_local_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
map_topic_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
map_update_sub_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const | nav2_costmap_2d::Costmap2D | |
matchSize() | nav2_costmap_2d::StaticLayer | virtual |
mutex_t typedef (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | |
name_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
node_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
onFootprintChanged() | nav2_costmap_2d::Layer | inlinevirtual |
onInitialize() | nav2_costmap_2d::StaticLayer | virtual |
operator=(const Costmap2D &map) | nav2_costmap_2d::Costmap2D | |
origin_x_ (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | protected |
origin_y_ (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | protected |
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::StaticLayer | protected |
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::Costmap2D | inlineprotected |
reset() | nav2_costmap_2d::StaticLayer | virtual |
resetMap(unsigned int x0, unsigned int y0, unsigned int xn, unsigned int yn) | nav2_costmap_2d::Costmap2D | |
resetMaps() | nav2_costmap_2d::Costmap2D | protectedvirtual |
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::Costmap2D | protected |
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::Costmap2D | inline |
size_x_ (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | protected |
size_y_ (defined in nav2_costmap_2d::Costmap2D) | nav2_costmap_2d::Costmap2D | protected |
StaticLayer() | nav2_costmap_2d::StaticLayer | |
subscribe_to_updates_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
tf_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
touch(double x, double y, double *min_x, double *min_y, double *max_x, double *max_y) | nav2_costmap_2d::CostmapLayer | protected |
track_unknown_space_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
transform_tolerance_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
transformed_footprint_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
trinary_costmap_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
unknown_cost_value_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
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::StaticLayer | virtual |
updateCosts(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | nav2_costmap_2d::StaticLayer | virtual |
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::StaticLayer | protected |
updateOrigin(double new_origin_x, double new_origin_y) | nav2_costmap_2d::Costmap2D | virtual |
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::CostmapLayer | protected |
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::CostmapLayer | protected |
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::CostmapLayer | protected |
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::CostmapLayer | protected |
use_maximum_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
useExtraBounds(double *min_x, double *min_y, double *max_x, double *max_y) (defined in nav2_costmap_2d::CostmapLayer) | nav2_costmap_2d::CostmapLayer | protected |
width_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) const | nav2_costmap_2d::Costmap2D | |
worldToMapEnforceBounds(double wx, double wy, int &mx, int &my) const | nav2_costmap_2d::Costmap2D | |
worldToMapNoBounds(double wx, double wy, int &mx, int &my) const | nav2_costmap_2d::Costmap2D | |
x_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
y_ (defined in nav2_costmap_2d::StaticLayer) | nav2_costmap_2d::StaticLayer | protected |
~Costmap2D() | nav2_costmap_2d::Costmap2D | virtual |
~Layer() | nav2_costmap_2d::Layer | inlinevirtual |
~StaticLayer() | nav2_costmap_2d::StaticLayer | virtual |