Public Member Functions | |
ArucoSimple () | |
void | cam_info_callback (const sensor_msgs::CameraInfo &msg) |
bool | getTransform (const std::string &refFrame, const std::string &childFrame, tf::StampedTransform &transform) |
void | image_callback (const sensor_msgs::ImageConstPtr &msg) |
Private Attributes | |
tf::TransformListener | _tfListener |
bool | cam_info_received |
ros::Subscriber | cam_info_sub |
std::string | camera_frame |
aruco::CameraParameters | camParam |
image_transport::Publisher | debug_pub |
image_transport::Publisher | image_pub |
image_transport::Subscriber | image_sub |
cv::Mat | inImage |
image_transport::ImageTransport | it |
std::string | marker_frame |
int | marker_id |
double | marker_size |
vector< Marker > | markers |
MarkerDetector | mDetector |
ros::NodeHandle | nh |
ros::Publisher | pose_pub |
ros::Publisher | position_pub |
std::string | reference_frame |
tf::StampedTransform | rightToLeft |
ros::Publisher | transform_pub |
bool | useRectifiedImages |
Definition at line 51 of file simple_single.cpp.
ArucoSimple::ArucoSimple | ( | ) | [inline] |
Definition at line 81 of file simple_single.cpp.
void ArucoSimple::cam_info_callback | ( | const sensor_msgs::CameraInfo & | msg | ) | [inline] |
Definition at line 247 of file simple_single.cpp.
bool ArucoSimple::getTransform | ( | const std::string & | refFrame, |
const std::string & | childFrame, | ||
tf::StampedTransform & | transform | ||
) | [inline] |
Definition at line 113 of file simple_single.cpp.
void ArucoSimple::image_callback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 149 of file simple_single.cpp.
Definition at line 78 of file simple_single.cpp.
bool ArucoSimple::cam_info_received [private] |
Definition at line 61 of file simple_single.cpp.
ros::Subscriber ArucoSimple::cam_info_sub [private] |
Definition at line 60 of file simple_single.cpp.
std::string ArucoSimple::camera_frame [private] |
Definition at line 68 of file simple_single.cpp.
aruco::CameraParameters ArucoSimple::camParam [private] |
Definition at line 55 of file simple_single.cpp.
Definition at line 63 of file simple_single.cpp.
Definition at line 62 of file simple_single.cpp.
Definition at line 76 of file simple_single.cpp.
cv::Mat ArucoSimple::inImage [private] |
Definition at line 54 of file simple_single.cpp.
Definition at line 75 of file simple_single.cpp.
std::string ArucoSimple::marker_frame [private] |
Definition at line 67 of file simple_single.cpp.
int ArucoSimple::marker_id [private] |
Definition at line 72 of file simple_single.cpp.
double ArucoSimple::marker_size [private] |
Definition at line 71 of file simple_single.cpp.
vector<Marker> ArucoSimple::markers [private] |
Definition at line 59 of file simple_single.cpp.
MarkerDetector ArucoSimple::mDetector [private] |
Definition at line 58 of file simple_single.cpp.
ros::NodeHandle ArucoSimple::nh [private] |
Definition at line 74 of file simple_single.cpp.
ros::Publisher ArucoSimple::pose_pub [private] |
Definition at line 64 of file simple_single.cpp.
ros::Publisher ArucoSimple::position_pub [private] |
Definition at line 66 of file simple_single.cpp.
std::string ArucoSimple::reference_frame [private] |
Definition at line 69 of file simple_single.cpp.
tf::StampedTransform ArucoSimple::rightToLeft [private] |
Definition at line 56 of file simple_single.cpp.
ros::Publisher ArucoSimple::transform_pub [private] |
Definition at line 65 of file simple_single.cpp.
bool ArucoSimple::useRectifiedImages [private] |
Definition at line 57 of file simple_single.cpp.