marker_manager.h
Go to the documentation of this file.
1 
18 #include <QMetaType>
19 
20 
21 #include <QThread>
22 #ifndef Q_MOC_RUN
23 #include <asr_msgs/AsrObject.h>
24 #include <Eigen/Core>
25 #include <Eigen/Geometry>
26 #include <ros/ros.h>
27 #include <tf/transform_datatypes.h>
28 #include <eigen_conversions/eigen_msg.h>
29 #include <asr_aruco_marker_recognition/GetRecognizer.h>
30 #include <asr_aruco_marker_recognition/ReleaseRecognizer.h>
31 #endif
32 
33 
34 
35 class Marker_Manager : public QThread
36 {
37  Q_OBJECT
38  public:
39  Marker_Manager(double timeout, double earlyabort_timeout, QObject *parent=0);
40  void run();
41  void markerRecognitionCallback(const asr_msgs::AsrObject::ConstPtr object);
42 
43  private:
47 
48  bool releaseRecognizer();
49  bool getRecognizer();
52  double timeout;
54  signals:
55  void markerFound(std::string markerNumber, const Eigen::Matrix4d &transformation);
56 };
57 
bool releaseRecognizer()
void markerRecognitionCallback(const asr_msgs::AsrObject::ConstPtr object)
Marker_Manager(double timeout, double earlyabort_timeout, QObject *parent=0)
ros::ServiceClient client_ReleaseRecognizer
double earlyabort_timeout
ros::NodeHandle nh
ros::Subscriber a
void markerFound(std::string markerNumber, const Eigen::Matrix4d &transformation)
ros::ServiceClient client_GetRecognizer


asr_mild_calibration_tool
Author(s): Aumann Florian, Heller Florian, Meißner Pascal
autogenerated on Mon Dec 2 2019 03:11:43