10 #include <mrpt/version.h> 15 TEST(PoseCovOps, composition) {
20 a.pose.position.x = -0.333330;
21 a.pose.position.y = 0;
22 a.pose.position.z = 0.100000;
24 a.pose.orientation.x = 0.707107;
25 a.pose.orientation.y = 0;
26 a.pose.orientation.z = 0.707107;
27 a.pose.orientation.w = -0.000005;
30 b.pose.position.x = 1.435644;
31 b.pose.position.y = 0;
32 b.pose.position.z = 0;
33 b.pose.orientation.x = 1.000000;
34 b.pose.orientation.y = 0;
35 b.pose.orientation.z = 0;
36 b.pose.orientation.w = 0;
45 #if MRPT_VERSION >= 0x199 46 std::cout <<
"a: " << a_mrpt.
asString() <<
"\nRot:\n" 48 std::cout <<
"b: " << b_mrpt.
asString() <<
"\nRot:\n" 50 std::cout <<
"a+b: " << ab_mrpt.
asString() <<
"\nRot:\n" 53 std::cout <<
"a: " << a <<
"\n";
54 std::cout <<
"b: " << b <<
"\n";
55 std::cout <<
"a(+)b: " << ab <<
"\n";
61 int main(
int argc,
char **argv) {
GLboolean GLboolean GLboolean GLboolean a
int main(int argc, char **argv)
void compose(const geometry_msgs::Pose &a, const geometry_msgs::Pose &b, geometry_msgs::Pose &out)
TEST(PoseCovOps, composition)
#define EXPECT_NEAR(val1, val2, abs_error)
void convert(const ros::Time &src, mrpt::system::TTimeStamp &des)
void asString(std::string &s) const
void getRotationMatrix(mrpt::math::CMatrixDouble33 &ROT) const
int RUN_ALL_TESTS() GTEST_MUST_USE_RESULT_
GTEST_API_ void InitGoogleTest(int *argc, char **argv)
GLdouble GLdouble GLdouble b