1 #include <gtest/gtest.h> 9 MapParams param(map.height(), map.width(), map.map_center_x(), map.map_center_y());
11 return param == expected_param;
14 TEST(AutoExpandbleMapBaseTests, Expand_Right) {
18 TEST(AutoExpandbleMapBaseTests, Expand_Top) {
22 TEST(AutoExpandbleMapBaseTests, Expand_Left) {
26 TEST(AutoExpandbleMapBaseTests, Expand_Down) {
30 TEST(AutoExpandbleMapBaseTests, Expand_Right_Top) {
34 TEST(AutoExpandbleMapBaseTests, Expand_Right_Down) {
38 TEST(AutoExpandbleMapBaseTests, Expand_Left_Top) {
42 TEST(AutoExpandbleMapBaseTests, Expand_Left_Down) {
46 TEST(AutoExpandbleMapBaseTests, NoExpand) {
50 TEST(AutoExpandbleMapBaseTests, CheckCellsValue) {
54 EXPECT_TRUE(not_change);
57 int main (
int argc,
char *argv[]) {
58 ::testing::InitGoogleTest(&argc, argv);
59 return RUN_ALL_TESTS();
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val)
An occupancy grid implementation.
A strategy creates cells of the base tiny model (BaseTinyCell).
void update_cell(const DiscretePoint2D &cell_coord, const Occupancy &new_value, double quality=1.0)
int main(int argc, char *argv[])
TEST(AutoExpandbleMapBaseTests, Expand_Right)
bool test_CellValueNotChange(GridMap map)
bool test_expansion_by_cell_update(const DiscretePoint2D &Cell_coor, MapParams expected_param)
Defines a point with integer coordinates on a plane.