| 3d_embedding.hpp | |
| actions.hpp | Implementation of useful range actions |
| algorithm.hpp | Includes all beluga algorithms |
| amcl_core.hpp | |
| assign.hpp | Implementation of the assign range adaptor object |
| beam_model.hpp | Implementation of a beam sensor model for range finders |
| bearing_sensor_model.hpp | Implementation of a discrete landmark bearing sensor model |
| beluga.hpp | Includes all the Beluga API |
| benchmark_likelihood_field_model.cpp | |
| benchmark_main.cpp | |
| benchmark_raycasting.cpp | |
| benchmark_spatial_hash.cpp | |
| benchmark_take_while_kld.cpp | |
| benchmark_tuple_vector.cpp | |
| bresenham.hpp | Implementation of Bresenham-like raytracing algorithms |
| ciabatta.hpp | |
| circular_array.hpp | Implementation of a generic circular array container |
| clang_tidy_findable.cpp | |
| cluster_based_estimation.hpp | Implementation of a cluster-based estimation algorithm |
| conf.py | |
| containers.hpp | Implementation of efficient containers |
| dense_grid.hpp | Concepts and abstract implementations of dense grids |
| differential_drive_model.hpp | Implementation of a differential drive odometry motion model |
| distance_map.hpp | Implementation of algorithm to calculate distance from obstacles |
| effective_sample_size.hpp | Implementation of an algorithm to calculate the effective sample size (ESS) |
| eigen_compatibility.hpp | |
| eigen_initializers.hpp | |
| elements.hpp | Implementation of the C++20's std::views::elements view |
| epilogue.hpp | |
| estimation.hpp | Implementation of algorithms that allow calculating the estimated state of a particle filter |
| every_n.hpp | Defines a policy for triggering an action every N calls |
| exponential_filter.hpp | Implementation of an exponential filter |
| forward_like.hpp | |
| indexing_iterator.hpp | Implementation of a random access iterator for indexable containers |
| landmark_detection_types.hpp | Auxiliar types for landmark models |
| landmark_map.hpp | Landmark map datatype |
| landmark_sensor_model.hpp | Implementation of a discrete landmark sensor model |
| laser_scan.hpp | Implementation of a laser scan interface |
| likelihood_field_model.hpp | Implementation of a likelihood field sensor model for range finders |
| linear_grid.hpp | Concepts and abstract implementations of linear (ie. contiguous storage) grids |
| motion.hpp | Includes all Beluga motion models |
| multivariate_distribution_traits.hpp | Implementation of multivariate distribution traits |
| multivariate_normal_distribution.hpp | Implementation of a multivariate normal distribution |
| multivariate_uniform_distribution.hpp | Implementation of a multivariate uniform distribution for SE(2) and SE(3) spaces |
| ndt_cell.hpp | |
| ndt_sensor_model.hpp | |
| normalize.hpp | Implementation of the normalize range adaptor object |
| occupancy_grid.hpp | Concepts and abstract implementations of occupancy grids |
| omnidirectional_drive_model.hpp | Implementation of an omnidirectional drive odometry motion model |
| on_effective_size_drop.hpp | Defines a policy for triggering an action based on the Effective Sample Size (ESS) metric |
| on_motion.hpp | Defines a policy for triggering an action based on motion |
| particle_traits.hpp | Implementation of traits for particle types, see the Particle named requirements |
| particles.hpp | Implementation of views related to particle ranges |
| policies.hpp | Implementation of useful policies |
| policy.hpp | |
| primitives.hpp | Implementation of library primitives to abstract member access |
| prologue.hpp | |
| propagate.hpp | Implementation of the propagate range adaptor object |
| random.hpp | Includes all Beluga random distributions |
| random_intersperse.hpp | Implementation of a random_intersperse range adaptor object |
| include/beluga/algorithm/raycasting.hpp | Implementation of raycasting algorithms |
| test/beluga/include/beluga/test/raycasting.hpp | |
| regular_grid.hpp | Concepts and abstract implementations of regular grids |
| reweight.hpp | Implementation of the reweight range adaptor object |
| sample.hpp | Implementation of a sample (with replacement) range adaptor object |
| sensor.hpp | Includes all Beluga sensor models and their interfaces |
| sophus_matchers.hpp | Implements GTest matchers for Sophus/Eigen types |
| sophus_printers.hpp | Implements printers for Sophus/Eigen types |
| sparse_value_grid.hpp | Implementation of generic sparse value regular grid |
| spatial_hash.hpp | Implementation of a spatial hash for N dimensional states |
| static_occupancy_grid.hpp | |
| stationary_model.hpp | Implementation of a stationary motion model |
| strongly_typed_numeric.hpp | Implementation of a strongly typed numeric helper |
| take_evenly.hpp | Implementation of a take_evenly range adaptor object |
| take_while_kld.hpp | Implementation of a take_while_kld range adaptor object |
| test_3d_embedding.cpp | |
| test_amcl_core.cpp | |
| test_assign.cpp | |
| test_beam_model.cpp | |
| test_bearing_sensor_model.cpp | |
| test_bresenham.cpp | |
| test_circular_array.cpp | |
| test_cluster_based_estimation.cpp | |
| test_dense_grid.cpp | |
| test_differential_drive_model.cpp | |
| test_distance_map.cpp | |
| test_effective_sample_size.cpp | |
| test_estimation.cpp | |
| test_every_n.cpp | |
| test_exponential_filter.cpp | |
| test_forward_like.cpp | |
| test_indexing_iterator.cpp | |
| test_landmark_map.cpp | |
| test_landmark_sensor_model.cpp | |
| test_laser_scan.cpp | |
| test_likelihood_field_model.cpp | |
| test_linear_grid.cpp | |
| test_multivariate_normal_distribution.cpp | |
| test_multivariate_uniform_distribution.cpp | |
| test_ndt_cell.cpp | |
| test_ndt_model.cpp | |
| test_normalize.cpp | |
| test_occupancy_grid.cpp | |
| test_omnidirectional_drive_model.cpp | |
| test_on_effective_size_drop.cpp | |
| test_on_motion.cpp | |
| test_particle_traits.cpp | |
| test_policy.cpp | |
| test_primitives.cpp | |
| test_propagate.cpp | |
| test_random_intersperse.cpp | |
| test_raycasting.cpp | |
| test_regular_grid.cpp | |
| test_reweight.cpp | |
| test_sample.cpp | |
| test_sophus_matchers.cpp | |
| test_sophus_printers.cpp | |
| test_sparse_value_grid.cpp | |
| test_spatial_hash.cpp | |
| test_strongly_typed_numeric.cpp | |
| test_take_evenly.cpp | |
| test_take_while_kld.cpp | |
| test_thrun_recovery_probability_estimator.cpp | |
| test_tuple_traits.cpp | |
| test_tuple_vector.cpp | |
| testing.hpp | Includes all the testing utilities |
| thrun_recovery_probability_estimator.hpp | |
| tuple_traits.hpp | Implementation of traits for tuple-like types |
| tuple_vector.hpp | Implementation of a tuple of containers |
| type_traits.hpp | Includes all Beluga type traits |
| value_grid.hpp | Implementation of generic value grid |
| views.hpp | Implementation of useful container views |
| zip.hpp | Implementation of a zip range adaptor object |