#include <aruco_node.h>
| Public Member Functions | |
| ArUcoNode (ros::NodeHandle &n) | |
| ~ArUcoNode () | |
| Private Member Functions | |
| void | configCallback (tuw_aruco::ArUcoConfig &config, uint32_t level) | 
| void | imageCallback (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::CameraInfoConstPtr &camer_info_) | 
| void | publishFiducials (const std_msgs::Header &header, vector< aruco::Marker > &markers, const sensor_msgs::CameraInfoConstPtr &camer_info_) | 
| void | publishMarkers (const std_msgs::Header &header, vector< ArUcoMarkerPose > &markerPoses) | 
| Private Attributes | |
| ArUcoBase | base_ | 
| image_transport::CameraSubscriber | cameraSubscriber_ | 
| dynamic_reconfigure::Server< tuw_aruco::ArUcoConfig >::CallbackType | configCallbackFnct_ | 
| dynamic_reconfigure::Server< tuw_aruco::ArUcoConfig > | configServer_ | 
| image_transport::ImageTransport | imageTransport_ | 
| ros::NodeHandle | n_ | 
| ros::Publisher | pub_fiducials_ | 
| ros::Publisher | pub_markers_ | 
| tf::TransformBroadcaster | transformBroadcaster_ | 
Definition at line 50 of file aruco_node.h.
| ArUcoNode::ArUcoNode | ( | ros::NodeHandle & | n | ) | 
Definition at line 42 of file aruco_node.cpp.
| ArUcoNode::~ArUcoNode | ( | ) | 
Definition at line 63 of file aruco_node.cpp.
| 
 | private | 
Definition at line 229 of file aruco_node.cpp.
| 
 | private | 
Definition at line 177 of file aruco_node.cpp.
| 
 | private | 
Definition at line 139 of file aruco_node.cpp.
| 
 | private | 
Definition at line 99 of file aruco_node.cpp.
| 
 | private | 
Definition at line 69 of file aruco_node.h.
| 
 | private | 
Definition at line 60 of file aruco_node.h.
| 
 | private | 
Definition at line 67 of file aruco_node.h.
| 
 | private | 
Definition at line 66 of file aruco_node.h.
| 
 | private | 
Definition at line 59 of file aruco_node.h.
| 
 | private | 
Definition at line 57 of file aruco_node.h.
| 
 | private | 
Definition at line 64 of file aruco_node.h.
| 
 | private | 
Definition at line 63 of file aruco_node.h.
| 
 | private | 
Definition at line 62 of file aruco_node.h.