30 #include <gtest/gtest.h>
34 #include <geometry_msgs/TransformStamped.h>
44 stor.
rotation_.setValue(0.0, 0.0, 0.0, 1.0);
49 unsigned int runs = 100;
56 for ( uint64_t i = 1; i < runs ; i++ )
92 EXPECT_TRUE(!std::isnan(stor.
rotation_.x()));
93 EXPECT_TRUE(!std::isnan(stor.
rotation_.y()));
94 EXPECT_TRUE(!std::isnan(stor.
rotation_.z()));
95 EXPECT_TRUE(!std::isnan(stor.
rotation_.w()));
98 int main(
int argc,
char **argv){
99 testing::InitGoogleTest(&argc, argv);
100 return RUN_ALL_TESTS();