#include <fstream>#include <gtest/gtest.h>#include <ros/package.h>#include <opencv2/core/core.hpp>#include <tf2_eigen/tf2_eigen.h>#include <sensor_msgs/CameraInfo.h>#include <pluginlib/class_loader.hpp>#include <geometry_msgs/TransformStamped.h>#include <moveit/handeye_calibration_target/handeye_target_base.h>
Go to the source code of this file.
Classes | |
| class | MoveItHandEyeTargetTester |
Functions | |
| int | main (int argc, char **argv) |
| TEST_F (MoveItHandEyeTargetTester, DetectArucoMarkerPose) | |
| TEST_F (MoveItHandEyeTargetTester, InitOK) | |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 155 of file handeye_target_aruco_test.cpp.
| TEST_F | ( | MoveItHandEyeTargetTester | , |
| DetectArucoMarkerPose | |||
| ) |
Definition at line 108 of file handeye_target_aruco_test.cpp.
| TEST_F | ( | MoveItHandEyeTargetTester | , |
| InitOK | |||
| ) |
Definition at line 100 of file handeye_target_aruco_test.cpp.