TestLoader.cpp
Go to the documentation of this file.
1 // SPDX-License-Identifier: BSD-3-Clause
2 
3 /*
4  * Copyright (c) 2020, Bjarne von Horn
5  * All rights reserved.
6  *
7  * Redistribution and use in source and binary forms, with or without
8  * modification, are permitted provided that the following conditions are met:
9  * * Redistributions of source code must retain the above copyright notice,
10  * this list of conditions and the following disclaimer.
11  * * Redistributions in binary form must reproduce the above copyright notice,
12  * this list of conditions and the following disclaimer in the documentation
13  * and/or other materials provided with the distribution.
14  * * Neither the name of the copyright holder nor the names of its contributors
15  * may be used to endorse or promote products derived from this software
16  * without specific prior written permission.
17  *
18  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS"
19  * AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO,
20  * THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE
21  * ARE DISCLAIMED. IN NO EVENT SHALL BJARNE VON HORN BE LIABLE FOR ANY DIRECT,
22  * INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES
23  * (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
24  * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND
25  * ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY,
26  * OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE
27  * OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
28  */
29 
30 #include <gtest/gtest.h>
31 #include <ros/ros.h>
33 #include <geometry_msgs/Vector3.h>
34 
35 TEST(DatabaseLoader, LoadSQLite)
36 {
38 
39  const auto d = l.loadDatabase();
40 
41  ASSERT_TRUE(static_cast<bool>(d));
42  d->setParams(":memory:", 0);
43 
44  ASSERT_TRUE(d->connect());
45 
46  using V = geometry_msgs::Vector3;
47  auto coll = d->openCollection<V>("main", "coll");
48  auto meta1 = coll.createMetadata();
49  meta1->append("x", 3);
50 
51  coll.insert(V(), meta1);
52 
53  EXPECT_EQ(coll.count(), 1U);
54 }
55 
56 int main(int argc, char** argv)
57 {
58  testing::InitGoogleTest(&argc, argv);
59  ros::init(argc, argv, "tester");
60  return RUN_ALL_TESTS();
61 }
ros::init
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
main
int main(int argc, char **argv)
Definition: TestLoader.cpp:56
ros.h
warehouse_ros::DatabaseLoader::loadDatabase
DatabaseConnection::Ptr loadDatabase()
database_loader.h
TEST
TEST(DatabaseLoader, LoadSQLite)
Definition: TestLoader.cpp:35
d
d
V
geometry_msgs::Vector3 V
Definition: BusyHandler.cpp:43
warehouse_ros::DatabaseLoader


warehouse_ros_sqlite
Author(s): Bjarne von Horn
autogenerated on Mon Oct 14 2024 02:16:58