#include <iostream>
#include <aruco/aruco.h>
#include <aruco/cvdrawingutils.h>
#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <aruco_ros/aruco_ros_utils.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_datatypes.h>
#include <dynamic_reconfigure/server.h>
#include <aruco_ros/ArucoThresholdConfig.h>
Go to the source code of this file.
Functions | |
void | cam_info_callback (const sensor_msgs::CameraInfo &msg) |
void | image_callback (const sensor_msgs::ImageConstPtr &msg) |
int | main (int argc, char **argv) |
void | reconf_callback (aruco_ros::ArucoThresholdConfig &config, uint32_t level) |
Variables | |
bool | cam_info_received |
ros::Subscriber | cam_info_sub |
aruco::CameraParameters | camParam |
std::string | child_name1 |
std::string | child_name2 |
int | dctComponentsToRemove |
image_transport::Publisher | debug_pub |
image_transport::Publisher | image_pub |
cv::Mat | inImage |
int | marker_id1 |
int | marker_id2 |
double | marker_size |
vector< Marker > | markers |
MarkerDetector | mDetector |
bool | normalizeImageIllumination |
std::string | parent_name |
ros::Publisher | pose_pub1 |
ros::Publisher | pose_pub2 |
bool | useRectifiedImages |
void cam_info_callback | ( | const sensor_msgs::CameraInfo & | msg | ) |
Definition at line 223 of file aruco_ros/src/simple_double.cpp.
void image_callback | ( | const sensor_msgs::ImageConstPtr & | msg | ) |
Definition at line 75 of file aruco_ros/src/simple_double.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 237 of file aruco_ros/src/simple_double.cpp.
void reconf_callback | ( | aruco_ros::ArucoThresholdConfig & | config, |
uint32_t | level | ||
) |
Definition at line 230 of file aruco_ros/src/simple_double.cpp.
bool cam_info_received |
Definition at line 62 of file aruco_ros/src/simple_double.cpp.
ros::Subscriber cam_info_sub |
Definition at line 61 of file aruco_ros/src/simple_double.cpp.
aruco::CameraParameters camParam |
Definition at line 56 of file aruco_ros/src/simple_double.cpp.
std::string child_name1 |
Definition at line 67 of file aruco_ros/src/simple_double.cpp.
std::string child_name2 |
Definition at line 69 of file aruco_ros/src/simple_double.cpp.
int dctComponentsToRemove |
Definition at line 58 of file aruco_ros/src/simple_double.cpp.
image_transport::Publisher debug_pub |
Definition at line 64 of file aruco_ros/src/simple_double.cpp.
image_transport::Publisher image_pub |
Definition at line 63 of file aruco_ros/src/simple_double.cpp.
cv::Mat inImage |
Definition at line 55 of file aruco_ros/src/simple_double.cpp.
int marker_id1 |
Definition at line 72 of file aruco_ros/src/simple_double.cpp.
int marker_id2 |
Definition at line 73 of file aruco_ros/src/simple_double.cpp.
double marker_size |
Definition at line 71 of file aruco_ros/src/simple_double.cpp.
vector<Marker> markers |
Definition at line 60 of file aruco_ros/src/simple_double.cpp.
MarkerDetector mDetector |
Definition at line 59 of file aruco_ros/src/simple_double.cpp.
bool normalizeImageIllumination |
Definition at line 57 of file aruco_ros/src/simple_double.cpp.
std::string parent_name |
Definition at line 68 of file aruco_ros/src/simple_double.cpp.
ros::Publisher pose_pub1 |
Definition at line 65 of file aruco_ros/src/simple_double.cpp.
ros::Publisher pose_pub2 |
Definition at line 66 of file aruco_ros/src/simple_double.cpp.
bool useRectifiedImages |
Definition at line 57 of file aruco_ros/src/simple_double.cpp.