#include "CvTestbed.h"#include "MarkerDetector.h"#include "MultiMarkerBundle.h"#include "MultiMarkerInitializer.h"#include "Shared.h"#include <cv_bridge/CvBridge.h>#include <ar_track_alvar/AlvarMarker.h>#include <ar_track_alvar/AlvarMarkers.h>#include <tf/transform_listener.h>
Go to the source code of this file.
| #define GHOST_MARKER 3 |
Definition at line 53 of file TrainMarkerBundle.cpp.
| #define MAIN_MARKER 1 |
Definition at line 51 of file TrainMarkerBundle.cpp.
| #define VISIBLE_MARKER 2 |
Definition at line 52 of file TrainMarkerBundle.cpp.
| void getCapCallback | ( | const sensor_msgs::ImageConstPtr & | image_msg | ) |
| double GetMultiMarkerPose | ( | IplImage * | image, |
| Pose & | pose | ||
| ) |
Definition at line 89 of file TrainMarkerBundle.cpp.
| int keyCallback | ( | int | key | ) |
| int keyProcess | ( | int | key | ) |
Definition at line 316 of file TrainMarkerBundle.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 370 of file TrainMarkerBundle.cpp.
| void makeMarkerMsgs | ( | int | type, |
| int | id, | ||
| Pose & | p, | ||
| sensor_msgs::ImageConstPtr | image_msg, | ||
| tf::StampedTransform & | CamToOutput, | ||
| visualization_msgs::Marker * | rvizMarker, | ||
| ar_track_alvar::AlvarMarker * | ar_pose_marker | ||
| ) |
| bool add_measurement = false |
Definition at line 71 of file TrainMarkerBundle.cpp.
Definition at line 59 of file TrainMarkerBundle.cpp.
Definition at line 61 of file TrainMarkerBundle.cpp.
| bool auto_collect |
Definition at line 68 of file TrainMarkerBundle.cpp.
| int auto_count |
Definition at line 67 of file TrainMarkerBundle.cpp.
| sensor_msgs::CvBridge bridge_ |
Definition at line 57 of file TrainMarkerBundle.cpp.
Definition at line 55 of file TrainMarkerBundle.cpp.
| std::string cam_image_topic |
Definition at line 78 of file TrainMarkerBundle.cpp.
| std::string cam_info_topic |
Definition at line 79 of file TrainMarkerBundle.cpp.
Definition at line 58 of file TrainMarkerBundle.cpp.
| IplImage* capture_ |
Definition at line 56 of file TrainMarkerBundle.cpp.
| bool init = true |
Definition at line 70 of file TrainMarkerBundle.cpp.
Definition at line 64 of file TrainMarkerBundle.cpp.
| double marker_size |
Definition at line 75 of file TrainMarkerBundle.cpp.
| double max_new_marker_error |
Definition at line 76 of file TrainMarkerBundle.cpp.
| double max_track_error |
Definition at line 77 of file TrainMarkerBundle.cpp.
| MultiMarkerBundle* multi_marker_bundle = NULL |
Definition at line 66 of file TrainMarkerBundle.cpp.
Definition at line 65 of file TrainMarkerBundle.cpp.
| int nof_markers |
Definition at line 81 of file TrainMarkerBundle.cpp.
| bool optimize = false |
Definition at line 72 of file TrainMarkerBundle.cpp.
| bool optimize_done = false |
Definition at line 73 of file TrainMarkerBundle.cpp.
| std::string output_frame |
Definition at line 80 of file TrainMarkerBundle.cpp.
Definition at line 60 of file TrainMarkerBundle.cpp.
Definition at line 63 of file TrainMarkerBundle.cpp.
Definition at line 62 of file TrainMarkerBundle.cpp.