Nav2 Navigation Stack - humble  humble
ROS 2 Navigation Stack
nav2_costmap_2d::RangeSensorLayer Member List

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

activate()nav2_costmap_2d::RangeSensorLayervirtual
addExtraBounds(double mx0, double my0, double mx1, double my1)nav2_costmap_2d::CostmapLayer
area(int x1, int y1, int x2, int y2, int x3, int y3)nav2_costmap_2d::RangeSensorLayerinlineprotected
buffered_readings_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
bufferIncomingRangeMsg(const sensor_msgs::msg::Range::SharedPtr range_message)nav2_costmap_2d::RangeSensorLayer
callback_group_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
cellDistance(double world_dist)nav2_costmap_2d::Costmap2D
clear_on_max_reading_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
clear_threshold_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
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
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::RangeSensorLayervirtual
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
delta(double phi)nav2_costmap_2d::RangeSensorLayerinlineprotected
enabled_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
gamma(double theta)nav2_costmap_2d::RangeSensorLayerinlineprotected
get_deltas(double angle, double *dx, double *dy)nav2_costmap_2d::RangeSensorLayerinlineprotected
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
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
global_frame_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
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
inflate_cone_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
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
InputSensorType enum name (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayer
isClearable()nav2_costmap_2d::RangeSensorLayerinlinevirtual
isCurrent() constnav2_costmap_2d::Layerinline
isDiscretized()nav2_costmap_2d::CostmapLayerinline
isEnabled() constnav2_costmap_2d::Layerinline
last_reading_time_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
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
mark_threshold_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
matchSize()nav2_costmap_2d::CostmapLayervirtual
max_angle_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
max_x_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
max_y_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
min_x_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
min_y_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
mutex_t typedef (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2D
name_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
no_readings_timeout_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
node_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
onFootprintChanged()nav2_costmap_2d::Layerinlinevirtual
onInitialize()nav2_costmap_2d::RangeSensorLayervirtual
operator=(const Costmap2D &map)nav2_costmap_2d::Costmap2D
orient2d(int Ax, int Ay, int Bx, int By, int Cx, int Cy)nav2_costmap_2d::RangeSensorLayerinlineprotected
origin_x_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
origin_y_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
phi_v_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
polygonOutlineCells(const std::vector< MapLocation > &polygon, std::vector< MapLocation > &polygon_cells)nav2_costmap_2d::Costmap2D
processFixedRangeMsg(sensor_msgs::msg::Range &range_message)nav2_costmap_2d::RangeSensorLayerprotected
processRangeMessageFunc_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
processRangeMsg(sensor_msgs::msg::Range &range_message)nav2_costmap_2d::RangeSensorLayerprotected
processVariableRangeMsg(sensor_msgs::msg::Range &range_message)nav2_costmap_2d::RangeSensorLayerprotected
range_message_mutex_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
range_msgs_buffer_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
range_subs_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
RangeSensorLayer()nav2_costmap_2d::RangeSensorLayer
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::RangeSensorLayervirtual
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
resetRange()nav2_costmap_2d::RangeSensorLayerprotected
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
saveMap(std::string file_name)nav2_costmap_2d::Costmap2D
sensor_model(double r, double phi, double theta)nav2_costmap_2d::RangeSensorLayerinlineprotected
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
size_x_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
size_y_ (defined in nav2_costmap_2d::Costmap2D)nav2_costmap_2d::Costmap2Dprotected
tf_ (defined in nav2_costmap_2d::Layer)nav2_costmap_2d::Layerprotected
to_cost(double p)nav2_costmap_2d::RangeSensorLayerinlineprotected
to_prob(unsigned char c)nav2_costmap_2d::RangeSensorLayerinlineprotected
touch(double x, double y, double *min_x, double *min_y, double *max_x, double *max_y)nav2_costmap_2d::CostmapLayerprotected
transform_tolerance_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
update_cell(double ox, double oy, double ot, double r, double nx, double ny, bool clear)nav2_costmap_2d::RangeSensorLayerinlineprotected
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::RangeSensorLayervirtual
updateCostmap()nav2_costmap_2d::RangeSensorLayerprotected
updateCostmap(sensor_msgs::msg::Range &range_message, bool clear_sensor_cone)nav2_costmap_2d::RangeSensorLayerprotected
updateCosts(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)nav2_costmap_2d::RangeSensorLayervirtual
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
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
was_reset_ (defined in nav2_costmap_2d::RangeSensorLayer)nav2_costmap_2d::RangeSensorLayerprotected
worldToMap(double wx, double wy, unsigned int &mx, unsigned int &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
~Costmap2D()nav2_costmap_2d::Costmap2Dvirtual
~Layer()nav2_costmap_2d::Layerinlinevirtual