Class AStarSearcher
Defined in File a_star_searcher.hpp
Inheritance Relationships
Base Type
public GraphSearcher< cv::Mat >
(Template Class GraphSearcher)
Class Documentation
-
class AStarSearcher : public GraphSearcher<cv::Mat>
Public Functions
Update the occupancy grid.
- Parameters:
occ_grid – occupancy grid
drone_pose – drone pose in cell coordinates
safety_distance – safety distance in meters
-
cv::Point2i cellToPixel(Point2i cell, int rows, int cols)
Convert cell coordinates to pixel coordinates.
- Parameters:
cell – cell coordinates
rows – number of rows
cols – number of columns
-
cv::Point2i cellToPixel(Point2i cell, cv::Mat map)
Convert cell coordinates to pixel coordinates.
- Parameters:
cell – cell coordinates
map – map
Convert cell coordinates to pixel coordinates.
- Parameters:
cell – cell coordinates
map_info – map metadata
Convert pixel coordinates to cell coordinates.
- Parameters:
pixel – pixel coordinates
map_info – map metadata
Occupancy grid to binary image
- Parameters:
occ_grid – occupancy grid
thresh – threshold value
unknown_as_free – if true, unknown cells are considered free
- Returns:
: binary image
-
nav_msgs::msg::OccupancyGrid imgToGrid(const cv::Mat img, const std_msgs::msg::Header &header, double grid_resolution)
Binary image to occupancy grid
- Parameters:
img – binary image
header – header of the occupancy grid
grid_resolution – resolution of the occupancy grid
- Returns:
: occupancy grid
Protected Functions
Protected Attributes
-
bool use_heuristic_ = true