|
Nav2 Navigation Stack - humble
humble
ROS 2 Navigation Stack
|
This is the complete list of members for nav2_costmap_2d::RangeSensorLayer, including all inherited members.
| activate() | nav2_costmap_2d::RangeSensorLayer | virtual |
| 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::RangeSensorLayer | inlineprotected |
| buffered_readings_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| bufferIncomingRangeMsg(const sensor_msgs::msg::Range::SharedPtr range_message) | nav2_costmap_2d::RangeSensorLayer | |
| callback_group_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| cellDistance(double world_dist) | nav2_costmap_2d::Costmap2D | |
| clear_on_max_reading_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| clear_threshold_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| 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::RangeSensorLayer | 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 |
| delta(double phi) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| enabled_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| gamma(double theta) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| get_deltas(double angle, double *dx, double *dy) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| 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 | |
| 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_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| has_extra_bounds_ (defined in nav2_costmap_2d::CostmapLayer) | nav2_costmap_2d::CostmapLayer | protected |
| hasParameter(const std::string ¶m_name) | nav2_costmap_2d::Layer | |
| indexToCells(unsigned int index, unsigned int &mx, unsigned int &my) const | nav2_costmap_2d::Costmap2D | inline |
| inflate_cone_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| 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 |
| InputSensorType enum name (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | |
| isClearable() | nav2_costmap_2d::RangeSensorLayer | inlinevirtual |
| isCurrent() const | nav2_costmap_2d::Layer | inline |
| isDiscretized() | nav2_costmap_2d::CostmapLayer | inline |
| isEnabled() const | nav2_costmap_2d::Layer | inline |
| last_reading_time_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| Layer() | nav2_costmap_2d::Layer | |
| layered_costmap_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | 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 |
| mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const | nav2_costmap_2d::Costmap2D | |
| mark_threshold_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| matchSize() | nav2_costmap_2d::CostmapLayer | virtual |
| max_angle_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| max_x_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| max_y_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| min_x_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| min_y_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| 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 |
| no_readings_timeout_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| node_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| onFootprintChanged() | nav2_costmap_2d::Layer | inlinevirtual |
| onInitialize() | nav2_costmap_2d::RangeSensorLayer | virtual |
| operator=(const Costmap2D &map) | nav2_costmap_2d::Costmap2D | |
| orient2d(int Ax, int Ay, int Bx, int By, int Cx, int Cy) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| 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 |
| phi_v_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| 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::RangeSensorLayer | protected |
| processRangeMessageFunc_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| processRangeMsg(sensor_msgs::msg::Range &range_message) | nav2_costmap_2d::RangeSensorLayer | protected |
| processVariableRangeMsg(sensor_msgs::msg::Range &range_message) | nav2_costmap_2d::RangeSensorLayer | protected |
| range_message_mutex_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| range_msgs_buffer_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| range_subs_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| 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::Costmap2D | inlineprotected |
| reset() | nav2_costmap_2d::RangeSensorLayer | 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 | |
| resetRange() | nav2_costmap_2d::RangeSensorLayer | protected |
| 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 | |
| sensor_model(double r, double phi, double theta) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| 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 |
| tf_ (defined in nav2_costmap_2d::Layer) | nav2_costmap_2d::Layer | protected |
| to_cost(double p) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| to_prob(unsigned char c) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| touch(double x, double y, double *min_x, double *min_y, double *max_x, double *max_y) | nav2_costmap_2d::CostmapLayer | protected |
| transform_tolerance_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | protected |
| update_cell(double ox, double oy, double ot, double r, double nx, double ny, bool clear) | nav2_costmap_2d::RangeSensorLayer | inlineprotected |
| 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::RangeSensorLayer | virtual |
| updateCostmap() | nav2_costmap_2d::RangeSensorLayer | protected |
| updateCostmap(sensor_msgs::msg::Range &range_message, bool clear_sensor_cone) | nav2_costmap_2d::RangeSensorLayer | protected |
| updateCosts(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j) | nav2_costmap_2d::RangeSensorLayer | virtual |
| 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 |
| useExtraBounds(double *min_x, double *min_y, double *max_x, double *max_y) (defined in nav2_costmap_2d::CostmapLayer) | nav2_costmap_2d::CostmapLayer | protected |
| was_reset_ (defined in nav2_costmap_2d::RangeSensorLayer) | nav2_costmap_2d::RangeSensorLayer | 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 | |
| ~Costmap2D() | nav2_costmap_2d::Costmap2D | virtual |
| ~Layer() | nav2_costmap_2d::Layer | inlinevirtual |