handeye_solver_default.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 
38 
39 #if PY_MAJOR_VERSION >= 3
40 #define PyInt_AsLong PyLong_AsLong
41 #define PyString_FromString PyUnicode_FromString
42 #endif
43 
45 {
46 const std::string LOGNAME = "handeye_solver_default";
47 
49 {
50  solver_names_ = { "Daniilidis1999", "ParkBryan1994", "TsaiLenz1989" };
51  camera_robot_pose_ = Eigen::Isometry3d::Identity();
52 }
53 
54 const std::vector<std::string>& HandEyeSolverDefault::getSolverNames() const
55 {
56  return solver_names_;
57 }
58 
59 const Eigen::Isometry3d& HandEyeSolverDefault::getCameraRobotPose() const
60 {
61  return camera_robot_pose_;
62 }
63 
64 bool HandEyeSolverDefault::solve(const std::vector<Eigen::Isometry3d>& effector_wrt_world,
65  const std::vector<Eigen::Isometry3d>& object_wrt_sensor, SensorMountType setup,
66  const std::string& solver_name, std::string* error_message)
67 {
68  std::string local_error_message;
69  if (!error_message)
70  {
71  error_message = &local_error_message;
72  }
73  // Check the size of the two sets of pose sample equal
74  if (effector_wrt_world.size() != object_wrt_sensor.size())
75  {
76  *error_message = "The sizes of the two input pose sample vectors are not equal: effector_wrt_world.size() = " +
77  std::to_string(effector_wrt_world.size()) +
78  " and object_wrt_sensor.size() == " + std::to_string(object_wrt_sensor.size());
79  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
80  return false;
81  }
82 
83  auto it = std::find(solver_names_.begin(), solver_names_.end(), solver_name);
84  if (it == solver_names_.end())
85  {
86  *error_message = "Unknown handeye solver name: " + solver_name;
87  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
88  return false;
89  }
90 
91  char program_name[7] = "python";
92 #if PY_MAJOR_VERSION >= 3
93  Py_SetProgramName(Py_DecodeLocale(program_name, NULL));
94 #else
95  Py_SetProgramName(program_name);
96 #endif
97  static bool numpy_loaded{ false };
98  if (!numpy_loaded) // Py_Initialize() can only be called once when numpy is
99  // loaded, otherwise will segfault
100  {
101  Py_Initialize();
102  atexit(Py_Finalize);
103  numpy_loaded = true;
104  }
105  ROS_DEBUG_STREAM_NAMED(LOGNAME, "Python C API start");
106 
107  // Load numpy c api
108  if (_import_array() < 0)
109  {
110  *error_message = "Error importing numpy";
111  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
112  return false;
113  }
114 
115  PyObject *python_name, *python_module, *python_class, *python_instance, *python_func_add_sample, *python_func_solve;
116  PyObject *python_args, *python_value;
117 
118  // Import handeye.calibrator python module
119  python_name = PyString_FromString("handeye.calibrator");
120  python_module = PyImport_Import(python_name);
121  Py_DECREF(python_name);
122  if (!python_module)
123  {
124  *error_message = "Failed to load python module: handeye.calibrator";
125  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
126  PyErr_Print();
127  return false;
128  }
129 
130  // Find handeye.calibrator.HandEyeCalibrator class
131  python_class = PyObject_GetAttrString(python_module, "HandEyeCalibrator");
132  Py_DECREF(python_module);
133  if (!python_class || !PyCallable_Check(python_class))
134  {
135  *error_message = "Can't find \"HandEyeCalibrator\" python class";
136  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
137  PyErr_Print();
138  return false;
139  }
140 
141  // Parse sensor mount type
142  python_value = PyString_FromString("");
143  if (setup == EYE_TO_HAND)
144  python_value = PyString_FromString("Fixed");
145  else if (setup == EYE_IN_HAND)
146  python_value = PyString_FromString("Moving");
147  if (!python_value)
148  {
149  *error_message = "Can't create sensor mount type python value";
150  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
151  Py_DECREF(python_class);
152  PyErr_Print();
153  return false;
154  }
155 
156  // Create handeye.calibrator.HandEyeCalibrator instance
157  python_args = PyTuple_New(1);
158  PyTuple_SetItem(python_args, 0, python_value);
159  if (!python_args)
160  {
161  *error_message = "Can't build python arguments";
162  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
163  Py_DECREF(python_class);
164  PyErr_Print();
165  return false;
166  }
167  python_instance = PyEval_CallObject(python_class, python_args);
168  Py_DECREF(python_args);
169  Py_DECREF(python_class);
170  if (!python_instance)
171  {
172  *error_message = "Can't create \"HandEyeCalibrator\" python instance";
173  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
174  PyErr_Print();
175  return false;
176  }
177 
178  // Find handeye.calibrator.HandEyeCalibrator.add_sample method
179  python_func_add_sample = PyObject_GetAttrString(python_instance, "add_sample");
180  if (!python_func_add_sample || !PyCallable_Check(python_func_add_sample))
181  {
182  *error_message = "Can't find 'add_sample' method";
183  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
184  Py_DECREF(python_instance);
185  PyErr_Print();
186  return false;
187  }
188 
189  // Add sample poses to handeye.calibrator.HandEyeCalibrator instance
190  size_t number_of_poses = effector_wrt_world.size();
191  PyArrayObject *numpy_arg_eef_wrt_base[number_of_poses], *numpy_arg_obj_wrt_sensor[number_of_poses];
192  PyObject *python_array_eef_wrt_base[number_of_poses], *python_array_obj_wrt_sensor[number_of_poses];
193  PyObject* python_args_sample[number_of_poses];
195  const int number_of_dims{ 2 };
196  // Using C array to store the pyarray data, which will be automatically freed
197  double c_arr_eef_wrt_world[number_of_poses][TRANSFORM_MATRIX_DIMENSION][TRANSFORM_MATRIX_DIMENSION];
198  double c_arr_obj_wrt_sensor[number_of_poses][TRANSFORM_MATRIX_DIMENSION][TRANSFORM_MATRIX_DIMENSION];
199  for (size_t i = 0; i < number_of_poses; ++i)
200  {
201  // Convert effector_wrt_world[i] from Eigen::isometry3d to C array
202  if (!toCArray(effector_wrt_world[i], c_arr_eef_wrt_world[i]))
203  {
204  *error_message = "Error converting Eigen::isometry3d to C array";
205  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
206  Py_DECREF(python_func_add_sample);
207  Py_DECREF(python_instance);
208  PyErr_Print();
209  return false;
210  }
211 
212  // From C array to PyArrayObject
213  python_array_eef_wrt_base[i] =
214  PyArray_SimpleNewFromData(number_of_dims, dims, NPY_DOUBLE, (void*)(c_arr_eef_wrt_world[i]));
215  if (!python_array_eef_wrt_base[i])
216  {
217  *error_message = "Error creating PyArray object";
218  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
219  Py_DECREF(python_func_add_sample);
220  Py_DECREF(python_instance);
221  PyErr_Print();
222  return false;
223  }
224  numpy_arg_eef_wrt_base[i] = (PyArrayObject*)(python_array_eef_wrt_base[i]);
225  if (PyArray_NDIM(numpy_arg_eef_wrt_base[i]) == 2) // Check PyArrayObject dims are 4x4
226  {
227  npy_intp* py_array_dims = PyArray_DIMS(numpy_arg_eef_wrt_base[i]);
228  if (py_array_dims[0] != 4 || py_array_dims[1] != 4)
229  {
230  *error_message =
231  "Error PyArrayObject dims: " + std::to_string(py_array_dims[0]) + "x" + std::to_string(py_array_dims[1]);
232  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
233  Py_DECREF(numpy_arg_eef_wrt_base[i]);
234  Py_DECREF(python_func_add_sample);
235  Py_DECREF(python_instance);
236  return false;
237  }
238  }
239 
240  // Convert object_wrt_sensor[i] from Eigen::isometry3d to C array
241  if (!toCArray(object_wrt_sensor[i], c_arr_obj_wrt_sensor[i]))
242  {
243  *error_message = "Error converting Eigen::isometry3d to C array";
244  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
245  Py_DECREF(python_func_add_sample);
246  Py_DECREF(python_instance);
247  PyErr_Print();
248  return false;
249  }
250 
251  // From C array to PyArrayObject
252  python_array_obj_wrt_sensor[i] =
253  PyArray_SimpleNewFromData(number_of_dims, dims, NPY_DOUBLE, (void*)(c_arr_obj_wrt_sensor[i]));
254  if (!python_array_obj_wrt_sensor[i])
255  {
256  *error_message = "Error creating PyArray object";
257  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
258  Py_DECREF(python_func_add_sample);
259  Py_DECREF(python_instance);
260  PyErr_Print();
261  return false;
262  }
263  numpy_arg_obj_wrt_sensor[i] = (PyArrayObject*)(python_array_obj_wrt_sensor[i]);
264  if (PyArray_NDIM(numpy_arg_obj_wrt_sensor[i]) == 2) // Check PyArrayObject dims are 4x4
265  {
266  npy_intp* py_array_dims = PyArray_DIMS(numpy_arg_obj_wrt_sensor[i]);
267  if (py_array_dims[0] != 4 || py_array_dims[1] != 4)
268  {
269  *error_message =
270  "Error PyArrayObject dims: " + std::to_string(py_array_dims[0]) + "x" + std::to_string(py_array_dims[1]);
271  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
272  Py_DECREF(numpy_arg_obj_wrt_sensor[i]);
273  Py_DECREF(python_func_add_sample);
274  Py_DECREF(python_instance);
275  return false;
276  }
277  }
278 
279  // Assign sample poses to 'HandEyeCalibrator' instance
280  python_args_sample[i] = Py_BuildValue("OO", numpy_arg_eef_wrt_base[i], numpy_arg_obj_wrt_sensor[i]);
281  if (!python_args_sample[i])
282  {
283  *error_message = "Can't create argument tuple for 'add_sample' method";
284  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
285  Py_DECREF(python_func_add_sample);
286  Py_DECREF(python_instance);
287  PyErr_Print();
288  return false;
289  }
290  python_value = PyEval_CallObject(python_func_add_sample, python_args_sample[i]);
291  if (!python_value)
292  {
293  *error_message = "Error calling 'add_sample' method";
294  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
295  Py_DECREF(python_func_add_sample);
296  Py_DECREF(python_instance);
297  PyErr_Print();
298  return false;
299  }
300  ROS_DEBUG_STREAM_NAMED(LOGNAME, "num_samples: " << PyInt_AsLong(python_value));
301  Py_DECREF(python_value);
302  }
303  Py_DECREF(python_func_add_sample);
304 
305  // print the pair of transforms as python arguments
306  for (size_t i = 0; i < number_of_poses; i++)
307  {
308  std::stringstream ss;
309  ss << "\nnp_arg_eef_wrt_base";
310  for (size_t m = 0; m < TRANSFORM_MATRIX_DIMENSION; m++)
311  {
312  ss << "\n";
313  for (size_t n = 0; n < TRANSFORM_MATRIX_DIMENSION; n++)
314  ss << *(double*)PyArray_GETPTR2(numpy_arg_eef_wrt_base[i], m, n) << " ";
315  }
316  ss << "\nnp_arg_obj_wrt_sensor";
317  for (size_t m = 0; m < TRANSFORM_MATRIX_DIMENSION; m++)
318  {
319  ss << "\n";
320  for (size_t n = 0; n < TRANSFORM_MATRIX_DIMENSION; n++)
321  ss << *(double*)PyArray_GETPTR2(numpy_arg_obj_wrt_sensor[i], m, n) << " ";
322  }
323  ROS_DEBUG_STREAM_NAMED(LOGNAME, ss.str());
324  }
325 
326  // Import handeye.solver python module
327  python_name = PyString_FromString("handeye.solver");
328  python_module = PyImport_Import(python_name);
329  Py_DECREF(python_name);
330  if (!python_module)
331  {
332  *error_message = "Failed to load python module: handeye.solver";
333  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
334  Py_DECREF(python_instance);
335  PyErr_Print();
336  return false;
337  }
338 
339  // Find handeye.solver.solver_name class
340  python_class = PyObject_GetAttrString(python_module, solver_name.c_str());
341  Py_DECREF(python_module);
342  if (!python_class || !PyCallable_Check(python_class))
343  {
344  *error_message = "Can't find \"" + solver_name + "\" python class";
345  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
346  Py_DECREF(python_instance);
347  PyErr_Print();
348  return false;
349  }
350 
351  // Find handeye.calibrator.HandEyeCalibrator.solve method
352  python_func_solve = PyObject_GetAttrString(python_instance, "solve");
353  if (!python_func_solve || !PyCallable_Check(python_func_solve))
354  {
355  *error_message = "Can't find 'solve' method";
356  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
357  Py_DECREF(python_class);
358  Py_DECREF(python_instance);
359  PyErr_Print();
360  return false;
361  }
362 
363  // Create argument list for 'solve' method
364  python_args = Py_BuildValue("{s:O}", "method", python_class);
365  Py_DECREF(python_class);
366  if (!python_args)
367  {
368  *error_message = "Can't create argument tuple for 'solve' method";
369  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
370  Py_DECREF(python_instance);
371  PyErr_Print();
372  return false;
373  }
374 
375  // Call 'solve' method to solve AX=XB problem
376  python_value = PyEval_CallObjectWithKeywords(python_func_solve, nullptr, python_args);
377  Py_DECREF(python_args);
378  Py_DECREF(python_func_solve);
379  for (size_t i = 0; i < number_of_poses; ++i)
380  Py_DECREF(python_args_sample[i]);
381  Py_DECREF(python_instance);
382  if (!python_value)
383  {
384  *error_message = "Error calling 'solve' method";
385  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
386  PyErr_Print();
387  return false;
388  }
389  PyArrayObject* np_ret = (PyArrayObject*)python_value;
390  if (!PyArray_Check(python_value) || PyArray_NDIM(np_ret) != 2 || PyArray_NBYTES(np_ret) != sizeof(double) * 16)
391  {
392  *error_message = "Did not return a valid array";
393  ROS_ERROR_STREAM_NAMED(LOGNAME, *error_message);
394  Py_DECREF(python_value);
395  PyErr_Print();
396  return false;
397  }
398 
399  std::stringstream ss;
400  ss << "\n Result camera-robot pose";
401  for (size_t m = 0; m < TRANSFORM_MATRIX_DIMENSION; m++)
402  {
403  ss << "\n";
404  for (size_t n = 0; n < TRANSFORM_MATRIX_DIMENSION; n++)
405  {
406  double item = *(double*)PyArray_GETPTR2(np_ret, m, n);
407  camera_robot_pose_(m, n) = item;
408  ss << item << " ";
409  }
410  }
411  ROS_DEBUG_STREAM_NAMED(LOGNAME, ss.str());
412 
413  Py_DECREF(python_value);
414  ROS_DEBUG_STREAM_NAMED(LOGNAME, "Python C API end");
415  return true;
416 }
417 
418 bool HandEyeSolverDefault::toCArray(const Eigen::Isometry3d& pose, double (*c_arr)[TRANSFORM_MATRIX_DIMENSION]) const
419 {
420  const Eigen::MatrixXd& mat = pose.matrix();
421 
422  if (mat.rows() != TRANSFORM_MATRIX_DIMENSION || mat.cols() != TRANSFORM_MATRIX_DIMENSION)
423  {
424  ROS_ERROR_NAMED(LOGNAME, "Error matrix dims: %zux%zu, required %dx%d", mat.rows(), mat.cols(),
426  return false;
427  }
428 
429  for (size_t i = 0; i < TRANSFORM_MATRIX_DIMENSION; ++i)
430  for (size_t j = 0; j < TRANSFORM_MATRIX_DIMENSION; ++j)
431  c_arr[i][j] = mat(i, j);
432  return true;
433 }
434 
435 } // namespace moveit_handeye_calibration
setup
ROS_DEBUG_STREAM_NAMED
#define ROS_DEBUG_STREAM_NAMED(name, args)
moveit_handeye_calibration::HandEyeSolverDefault::toCArray
bool toCArray(const Eigen::Isometry3d &pose, double(*c_arr)[TRANSFORM_MATRIX_DIMENSION]) const
Convert a Eigen::Isometry3d pose to a 4x4 C array.
Definition: handeye_solver_default.cpp:450
ROS_ERROR_NAMED
#define ROS_ERROR_NAMED(name,...)
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
moveit_handeye_calibration::HandEyeSolverDefault::getSolverNames
virtual const std::vector< std::string > & getSolverNames() const override
Get the names of available algorithms that can be used from the plugin.
Definition: handeye_solver_default.cpp:86
ROS_ERROR_STREAM_NAMED
#define ROS_ERROR_STREAM_NAMED(name, args)
moveit_handeye_calibration::SensorMountType
SensorMountType
Definition: handeye_solver_base.h:76
moveit_handeye_calibration::HandEyeSolverDefault::camera_robot_pose_
Eigen::Isometry3d camera_robot_pose_
Definition: handeye_solver_default.h:84
moveit_handeye_calibration::HandEyeSolverDefault::solver_names_
std::vector< std::string > solver_names_
Definition: handeye_solver_default.h:83
moveit_handeye_calibration::TRANSFORM_MATRIX_DIMENSION
constexpr auto TRANSFORM_MATRIX_DIMENSION
Definition: handeye_solver_default.h:57
moveit_handeye_calibration
Definition: handeye_solver_base.h:42
moveit_handeye_calibration::LOGNAME
const std::string LOGNAME
Definition: handeye_solver_default.cpp:78
handeye_solver_default.h
moveit_handeye_calibration::HandEyeSolverDefault::getCameraRobotPose
virtual const Eigen::Isometry3d & getCameraRobotPose() const override
Get the result of the calibration, i.e. the camera pose with respect to the robot.
Definition: handeye_solver_default.cpp:91
moveit_handeye_calibration::HandEyeSolverDefault::solve
virtual bool solve(const std::vector< Eigen::Isometry3d > &effector_wrt_world, const std::vector< Eigen::Isometry3d > &object_wrt_sensor, SensorMountType setup=EYE_TO_HAND, const std::string &solver_name="TsaiLenz1989", std::string *error_message=nullptr) override
Calculate camera-robot transform from the input pose samples.
Definition: handeye_solver_default.cpp:96
moveit_handeye_calibration::HandEyeSolverDefault::initialize
virtual void initialize() override
Definition: handeye_solver_default.cpp:80


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