Classes | Public Member Functions | Private Attributes | List of all members
beluga::testing::StaticOccupancyGrid< Rows, Cols > Class Template Reference

#include <static_occupancy_grid.hpp>

Inheritance diagram for beluga::testing::StaticOccupancyGrid< Rows, Cols >:
Inheritance graph
[legend]

Classes

struct  ValueTraits
 

Public Member Functions

auto & data ()
 
const auto & data () const
 
std::size_t height () const
 
const Sophus::SE2dorigin () const
 
double resolution () const
 
std::size_t size () const
 
 StaticOccupancyGrid (std::array< bool, Rows *Cols > array, double resolution=1.0, const Sophus::SE2d &origin=Sophus::SE2d{})
 
auto value_traits () const
 
std::size_t width () const
 
- Public Member Functions inherited from beluga::BaseOccupancyGrid2< StaticOccupancyGrid< Rows, Cols > >
auto coordinates_at (std::size_t index, Frame frame) const
 Compute plane coordinates given grid cell coordinates. More...
 
auto coordinates_for (Range &&cells, Frame frame) const
 Compute plane coordinates for a range of grid cells. More...
 
bool free_at (const Eigen::Vector2i &pi) const
 Checks if cell is free. More...
 
bool free_at (int xi, int yi) const
 Checks if cell is free. More...
 
bool free_at (std::size_t index) const
 Checks if cell is free. More...
 
auto free_cells () const
 Retrieves range of free grid cell indices. More...
 
bool free_near (const Eigen::Vector2d &p) const
 Checks if nearest cell is free. More...
 
bool free_near (double x, double y) const
 Checks if nearest cell is free. More...
 
auto obstacle_data () const
 Retrieves grid data using true booleans for obstacles. More...
 
- Public Member Functions inherited from beluga::BaseLinearGrid2< StaticOccupancyGrid< Rows, Cols > >
Eigen::Vector2d coordinates_at (std::size_t index) const
 Compute plane coordinates given a grid cell index. More...
 
auto data_at (std::size_t index) const
 Gets cell data, if included. More...
 
std::size_t index_at (const Eigen::Vector2i &pi) const
 Computes index for given grid cell coordinates. More...
 
std::size_t index_at (int xi, int yi) const
 Computes index for given grid cell coordinates. More...
 
auto neighborhood4 (std::size_t index) const
 Computes 4-connected neighborhood for cell. More...
 
- Public Member Functions inherited from beluga::BaseDenseGrid2< StaticOccupancyGrid< Rows, Cols > >
bool contains (const Eigen::Vector2i &pi) const
 Checks if a cell is included in the grid. More...
 
bool contains (int xi, int yi) const
 Checks if a cell is included in the grid. More...
 
auto data_at (const Eigen::Vector2i &pi) const
 Gets cell data, if included. More...
 
auto data_at (int xi, int yi) const
 Gets cell data, if included. More...
 
auto data_near (const Eigen::Vector2d &p) const
 Gets nearest cell data, if included. More...
 
auto data_near (double x, double y) const
 Gets nearest cell data, if included. More...
 
auto neighborhood4 (const Eigen::Vector2i &pi) const
 Computes 4-connected neighborhood for cell. More...
 
auto neighborhood4 (int xi, int yi) const
 Computes 4-connected neighborhood for cell. More...
 
- Public Member Functions inherited from beluga::BaseRegularGrid< Derived, NDim >
Eigen::Vector< int, NDim > cell_near (const Eigen::Vector< double, NDim > &p) const
 Compute nearest grid cell coordinates given plane coordinates. More...
 
Eigen::Vector< double, NDim > coordinates_at (const Eigen::Vector< int, NDim > &pi) const
 Compute plane coordinates given grid cell coordinates. More...
 
template<class Range >
auto coordinates_for (Range &&cells) const
 Compute plane coordinates given a range of cell coordinates. More...
 

Private Attributes

std::array< bool, Rows *Cols > grid_
 
Sophus::SE2d origin_
 
double resolution_
 

Additional Inherited Members

- Public Types inherited from beluga::BaseOccupancyGrid2< StaticOccupancyGrid< Rows, Cols > >
enum  Frame
 Coordinate frames. More...
 

Detailed Description

template<std::size_t Rows, std::size_t Cols>
class beluga::testing::StaticOccupancyGrid< Rows, Cols >

Definition at line 28 of file static_occupancy_grid.hpp.

Constructor & Destructor Documentation

◆ StaticOccupancyGrid()

template<std::size_t Rows, std::size_t Cols>
beluga::testing::StaticOccupancyGrid< Rows, Cols >::StaticOccupancyGrid ( std::array< bool, Rows *Cols >  array,
double  resolution = 1.0,
const Sophus::SE2d origin = Sophus::SE2d{} 
)
inlineexplicit

Definition at line 36 of file static_occupancy_grid.hpp.

Member Function Documentation

◆ data() [1/2]

template<std::size_t Rows, std::size_t Cols>
auto& beluga::testing::StaticOccupancyGrid< Rows, Cols >::data ( )
inline

Definition at line 44 of file static_occupancy_grid.hpp.

◆ data() [2/2]

template<std::size_t Rows, std::size_t Cols>
const auto& beluga::testing::StaticOccupancyGrid< Rows, Cols >::data ( ) const
inline

Definition at line 45 of file static_occupancy_grid.hpp.

◆ height()

template<std::size_t Rows, std::size_t Cols>
std::size_t beluga::testing::StaticOccupancyGrid< Rows, Cols >::height ( ) const
inline

Definition at line 49 of file static_occupancy_grid.hpp.

◆ origin()

template<std::size_t Rows, std::size_t Cols>
const Sophus::SE2d& beluga::testing::StaticOccupancyGrid< Rows, Cols >::origin ( ) const
inline

Definition at line 42 of file static_occupancy_grid.hpp.

◆ resolution()

template<std::size_t Rows, std::size_t Cols>
double beluga::testing::StaticOccupancyGrid< Rows, Cols >::resolution ( ) const
inline

Definition at line 50 of file static_occupancy_grid.hpp.

◆ size()

template<std::size_t Rows, std::size_t Cols>
std::size_t beluga::testing::StaticOccupancyGrid< Rows, Cols >::size ( ) const
inline

Definition at line 46 of file static_occupancy_grid.hpp.

◆ value_traits()

template<std::size_t Rows, std::size_t Cols>
auto beluga::testing::StaticOccupancyGrid< Rows, Cols >::value_traits ( ) const
inline

Definition at line 52 of file static_occupancy_grid.hpp.

◆ width()

template<std::size_t Rows, std::size_t Cols>
std::size_t beluga::testing::StaticOccupancyGrid< Rows, Cols >::width ( ) const
inline

Definition at line 48 of file static_occupancy_grid.hpp.

Member Data Documentation

◆ grid_

template<std::size_t Rows, std::size_t Cols>
std::array<bool, Rows * Cols> beluga::testing::StaticOccupancyGrid< Rows, Cols >::grid_
private

Definition at line 55 of file static_occupancy_grid.hpp.

◆ origin_

template<std::size_t Rows, std::size_t Cols>
Sophus::SE2d beluga::testing::StaticOccupancyGrid< Rows, Cols >::origin_
private

Definition at line 56 of file static_occupancy_grid.hpp.

◆ resolution_

template<std::size_t Rows, std::size_t Cols>
double beluga::testing::StaticOccupancyGrid< Rows, Cols >::resolution_
private

Definition at line 57 of file static_occupancy_grid.hpp.


The documentation for this class was generated from the following file:


beluga
Author(s):
autogenerated on Tue Jul 16 2024 02:59:54