handeye_solver_test.cpp
Go to the documentation of this file.
1 /*********************************************************************
2  * Software License Agreement (BSD License)
3  *
4  * Copyright (c) 2019, Intel Corporation.
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
9  * are met:
10  *
11  * * Redistributions of source code must retain the above copyright
12  * notice, this list of conditions and the following disclaimer.
13  * * Redistributions in binary form must reproduce the above
14  * copyright notice, this list of conditions and the following
15  * disclaimer in the documentation and/or other materials provided
16  * with the distribution.
17  * * Neither the name of Willow Garage nor the names of its
18  * contributors may be used to endorse or promote products derived
19  * from this software without specific prior written permission.
20  *
21  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
22  * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
23  * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
24  * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
25  * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
26  * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
27  * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
28  * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
29  * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
30  * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
31  * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
32  * POSSIBILITY OF SUCH DAMAGE.
33  *********************************************************************/
34 
35 /* Author: Yu Yan */
36 
37 #include <fstream>
38 #include <gtest/gtest.h>
39 #include <jsoncpp/json/json.h>
42 #include <ros/package.h>
43 
44 class MoveItHandEyeSolverTester : public ::testing::Test
45 {
46 protected:
47  void SetUp() override
48  {
49  solver_ok_ = false;
50  try
51  {
53  "moveit_calibration_plugins", "moveit_handeye_calibration::HandEyeSolverBase"));
54  solver_ = solver_plugins_loader_->createUniqueInstance("crigroup");
55  solver_->initialize();
56  }
57  catch (const pluginlib::PluginlibException& ex)
58  {
59  ROS_ERROR_STREAM("Exception while creating handeye target plugin: " << ex.what());
60  return;
61  }
62 
63  Json::Reader reader;
64  std::string moveit_calibration_plugins_package_path = ros::package::getPath("moveit_calibration_plugins");
65  moveit_calibration_plugins_package_path += "/handeye_calibration_solver/test/pose_samples.json";
66  std::ifstream ifs(moveit_calibration_plugins_package_path);
67 
68  if (ifs)
69  {
70  if (reader.parse(ifs, root_))
71  {
72  solver_ok_ = true;
73  }
74  else
75  ROS_ERROR_STREAM("Can't parse json file: ./pose_samples.json");
76  }
77  else
78  ROS_ERROR_STREAM("Can't load file: ./pose_samples.json");
79  }
80 
81  void TearDown() override
82  {
83  }
84 
85 protected:
86  pluginlib::UniquePtr<moveit_handeye_calibration::HandEyeSolverBase> solver_;
87  std::unique_ptr<pluginlib::ClassLoader<moveit_handeye_calibration::HandEyeSolverBase>> solver_plugins_loader_;
88  Json::Value root_;
89  bool solver_ok_;
90 };
91 
93 {
94  ASSERT_TRUE(solver_);
95  ASSERT_TRUE(solver_ok_);
96  ASSERT_EQ(root_.size(), 50);
97 }
98 
100 {
101  const std::vector<std::string>& solver_names = solver_->getSolverNames();
102  ASSERT_EQ(solver_names.size(), 3);
103  ASSERT_EQ(solver_names[0], "Daniilidis1999");
104  ASSERT_EQ(solver_names[1], "ParkBryan1994");
105  ASSERT_EQ(solver_names[2], "TsaiLenz1989");
106 }
107 
109 {
110  std::vector<Eigen::Isometry3d> eef_wrt_world(root_.size(), Eigen::Isometry3d::Identity());
111  std::vector<Eigen::Isometry3d> obj_wrt_sensor(root_.size(), Eigen::Isometry3d::Identity());
112 
113  for (int i = 0; i < root_.size(); ++i)
114  {
115  Json::Value json_eef_wrt_world = root_[i][0];
116  ASSERT_EQ(json_eef_wrt_world.size(), 4);
117  for (int m = 0; m < json_eef_wrt_world.size(); ++m)
118  {
119  ASSERT_EQ(json_eef_wrt_world[m].size(), 4);
120  for (int n = 0; n < json_eef_wrt_world[m].size(); ++n)
121  eef_wrt_world[i](m, n) = json_eef_wrt_world[m][n].asDouble();
122  }
123 
124  Json::Value json_obj_wrt_sensor = root_[i][1];
125  ASSERT_EQ(json_obj_wrt_sensor.size(), 4);
126  for (int m = 0; m < json_obj_wrt_sensor.size(); ++m)
127  {
128  ASSERT_EQ(json_obj_wrt_sensor[m].size(), 4);
129  for (int n = 0; n < json_obj_wrt_sensor[m].size(); ++n)
130  obj_wrt_sensor[i](m, n) = json_obj_wrt_sensor[m][n].asDouble();
131  }
132  }
133 
134  const std::vector<std::string>& solver_names = solver_->getSolverNames();
135  for (const std::string& name : solver_names)
136  {
137  // Fake test for EYE_IN_HAND to check if segfault happens when loaded
138  // multiple times
139  std::string error_message;
140  bool res =
141  solver_->solve(eef_wrt_world, obj_wrt_sensor, moveit_handeye_calibration::EYE_IN_HAND, name, &error_message);
142  ASSERT_TRUE(res);
143  // Test EYE_TO_HAND from real data
144  res = solver_->solve(eef_wrt_world, obj_wrt_sensor, moveit_handeye_calibration::EYE_TO_HAND, name, &error_message);
145  ASSERT_TRUE(res);
146  Eigen::Vector3d t(0.659, -0.249, 0.830);
147  Eigen::Vector3d r(0.230, -2.540, 1.950);
148  Eigen::Isometry3d ret = solver_->getCameraRobotPose();
149  ASSERT_TRUE(ret.translation().isApprox(t, 0.01));
150  ASSERT_TRUE(ret.rotation().eulerAngles(0, 1, 2).isApprox(r, 0.01));
151  }
152 }
153 
154 int main(int argc, char** argv)
155 {
156  testing::InitGoogleTest(&argc, argv);
157  return RUN_ALL_TESTS();
158 }
handeye_solver_base.h
ros::package::getPath
ROSLIB_DECL std::string getPath(const std::string &package_name)
ROS_ERROR_STREAM
#define ROS_ERROR_STREAM(args)
MoveItHandEyeSolverTester
Definition: handeye_solver_test.cpp:44
moveit_handeye_calibration::EYE_TO_HAND
@ EYE_TO_HAND
Definition: handeye_solver_base.h:110
moveit_handeye_calibration::EYE_IN_HAND
@ EYE_IN_HAND
Definition: handeye_solver_base.h:111
pluginlib::PluginlibException
MoveItHandEyeSolverTester::SetUp
void SetUp() override
Definition: handeye_solver_test.cpp:79
pluginlib::ClassLoader
class_loader.hpp
package.h
r
S r
TEST_F
TEST_F(MoveItHandEyeSolverTester, InitOK)
Definition: handeye_solver_test.cpp:92
MoveItHandEyeSolverTester::solver_
pluginlib::UniquePtr< moveit_handeye_calibration::HandEyeSolverBase > solver_
Definition: handeye_solver_test.cpp:118
MoveItHandEyeSolverTester::root_
Json::Value root_
Definition: handeye_solver_test.cpp:120
MoveItHandEyeSolverTester::solver_plugins_loader_
std::unique_ptr< pluginlib::ClassLoader< moveit_handeye_calibration::HandEyeSolverBase > > solver_plugins_loader_
Definition: handeye_solver_test.cpp:119
MoveItHandEyeSolverTester::TearDown
void TearDown() override
Definition: handeye_solver_test.cpp:113
MoveItHandEyeSolverTester::solver_ok_
bool solver_ok_
Definition: handeye_solver_test.cpp:121
main
int main(int argc, char **argv)
Definition: handeye_solver_test.cpp:154
t
geometry_msgs::TransformStamped t


moveit_calibration_plugins
Author(s): Yu Yan
autogenerated on Fri Oct 18 2024 02:14:08