test_amcl.cpp
Go to the documentation of this file.
1 // Copyright 2024 Ekumen, Inc.
2 //
3 // Licensed under the Apache License, Version 2.0 (the "License");
4 // you may not use this file except in compliance with the License.
5 // You may obtain a copy of the License at
6 //
7 // http://www.apache.org/licenses/LICENSE-2.0
8 //
9 // Unless required by applicable law or agreed to in writing, software
10 // distributed under the License is distributed on an "AS IS" BASIS,
11 // WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
12 // See the License for the specific language governing permissions and
13 // limitations under the License.
14 
15 #include <gtest/gtest.h>
16 
17 #include <cstddef>
18 #include <cstdint>
19 #include <execution>
20 #include <memory>
21 #include <vector>
22 
23 #include <Eigen/Core>
24 
25 #if BELUGA_ROS_VERSION == 1
26 #include <boost/smart_ptr.hpp>
27 #endif
28 
31 
32 #include "beluga_ros/amcl.hpp"
34 #include "beluga_ros/messages.hpp"
35 
36 namespace {
37 
38 auto make_dummy_occupancy_grid() {
39  constexpr std::size_t kWidth = 100;
40  constexpr std::size_t kHeight = 200;
41 
42 #if BELUGA_ROS_VERSION == 2
43  auto message = std::make_shared<beluga_ros::msg::OccupancyGrid>();
44 #elif BELUGA_ROS_VERSION == 1
45  auto message = boost::make_shared<beluga_ros::msg::OccupancyGrid>();
46 #else
47 #error BELUGA_ROS_VERSION is not defined or invalid
48 #endif
49  message->info.resolution = 0.1F;
50  message->info.width = kWidth;
51  message->info.height = kHeight;
52  message->info.origin.position.x = 1;
53  message->info.origin.position.y = 2;
54  message->info.origin.position.z = 0;
55  message->data = std::vector<std::int8_t>(kWidth * kHeight);
56 
58 }
59 
60 auto make_dummy_laser_scan() {
61 #if BELUGA_ROS_VERSION == 2
62  auto message = std::make_shared<beluga_ros::msg::LaserScan>();
63 #elif BELUGA_ROS_VERSION == 1
64  auto message = boost::make_shared<beluga_ros::msg::LaserScan>();
65 #endif
66  message->ranges = std::vector<float>{1., 2., 3.};
67  message->range_min = 10.F;
68  message->range_max = 100.F;
70 }
71 
72 auto make_amcl() {
73  auto map = make_dummy_occupancy_grid();
74  auto params = beluga_ros::AmclParams{};
75  params.max_particles = 50UL;
76  return beluga_ros::Amcl{
77  map, //
80  params, //
81  std::execution::seq,
82  };
83 }
84 
85 TEST(TestAmcl, InitializeWithNoParticles) {
86  auto amcl = make_amcl();
87  ASSERT_EQ(amcl.particles().size(), 0);
88 }
89 
90 TEST(TestAmcl, InitializeFromMap) {
91  auto amcl = make_amcl();
92  amcl.initialize_from_map();
93  ASSERT_EQ(amcl.particles().size(), 50UL);
94 }
95 
96 TEST(TestAmcl, InitializeFromPose) {
97  auto amcl = make_amcl();
98  amcl.initialize(Sophus::SE2d{}, Eigen::Vector3d::Ones().asDiagonal());
99  ASSERT_EQ(amcl.particles().size(), 50UL);
100 }
101 
102 TEST(TestAmcl, UpdateWithNoParticles) {
103  auto amcl = make_amcl();
104  ASSERT_EQ(amcl.particles().size(), 0);
105  auto estimate = amcl.update(Sophus::SE2d{}, make_dummy_laser_scan());
106  ASSERT_FALSE(estimate.has_value());
107 }
108 
109 TEST(TestAmcl, UpdateWithParticles) {
110  auto amcl = make_amcl();
111  ASSERT_EQ(amcl.particles().size(), 0);
112  amcl.initialize_from_map();
113  ASSERT_EQ(amcl.particles().size(), 50UL);
114  auto estimate = amcl.update(Sophus::SE2d{}, make_dummy_laser_scan());
115  ASSERT_TRUE(estimate.has_value());
116 }
117 
118 TEST(TestAmcl, UpdateWithParticlesNoMotion) {
119  auto amcl = make_amcl();
120  ASSERT_EQ(amcl.particles().size(), 0);
121  amcl.initialize_from_map();
122  ASSERT_EQ(amcl.particles().size(), 50UL);
123  auto estimate = amcl.update(Sophus::SE2d{}, make_dummy_laser_scan());
124  ASSERT_TRUE(estimate.has_value());
125  estimate = amcl.update(Sophus::SE2d{}, make_dummy_laser_scan());
126  ASSERT_FALSE(estimate.has_value());
127 }
128 
129 TEST(TestAmcl, UpdateWithParticlesForced) {
130  auto amcl = make_amcl();
131  ASSERT_EQ(amcl.particles().size(), 0);
132  amcl.initialize_from_map();
133  ASSERT_EQ(amcl.particles().size(), 50UL);
134  auto estimate = amcl.update(Sophus::SE2d{}, make_dummy_laser_scan());
135  ASSERT_TRUE(estimate.has_value());
136  amcl.force_update();
137  estimate = amcl.update(Sophus::SE2d{}, make_dummy_laser_scan());
138  ASSERT_TRUE(estimate.has_value());
139 }
140 
141 } // namespace
beluga_ros::OccupancyGrid
Thin wrapper type for 2D nav_msgs/OccupancyGrid messages.
Definition: occupancy_grid.hpp:47
TEST
TEST(ActionClientDestruction, persistent_goal_handles_1)
beluga_ros::AmclParams
Struct containing parameters for the Adaptive Monte Carlo Localization (AMCL) implementation.
Definition: amcl.hpp:36
amcl.hpp
Generic two-dimensional implementation of the Adaptive Monte Carlo Localization (AMCL) algorithm in 2...
differential_drive_model.hpp
beluga::DifferentialDriveModelParam
beluga_ros::AmclParams::max_particles
std::size_t max_particles
Maximum allowed number of particles.
Definition: amcl.hpp:57
beluga_ros.conversion_utils.message
message
Definition: conversion_utils.py:29
beluga::LikelihoodFieldModel
Sophus::SE2
laser_scan.hpp
Implementation of sensor_msgs/LaserScan wrapper type.
beluga_ros::Amcl
Definition: amcl.hpp:88
beluga::DifferentialDriveModel
beluga::LikelihoodFieldModelParam
beluga_ros::LaserScan
Thin wrapper type for 2D sensor_msgs/LaserScan messages.
Definition: laser_scan.hpp:34
likelihood_field_model.hpp
estimate
std::pair< Sophus::SE2< Scalar >, Sophus::Matrix3< Scalar > > estimate(Poses &&poses)
messages.hpp


beluga_ros
Author(s):
autogenerated on Tue Jul 16 2024 03:00:02