Public Member Functions | Private Member Functions | Private Attributes | List of all members
ArUcoNode Class Reference

#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_
 

Detailed Description

Definition at line 50 of file aruco_node.h.

Constructor & Destructor Documentation

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.

Member Function Documentation

void ArUcoNode::configCallback ( tuw_aruco::ArUcoConfig &  config,
uint32_t  level 
)
private

Definition at line 229 of file aruco_node.cpp.

void ArUcoNode::imageCallback ( const sensor_msgs::ImageConstPtr &  image_msg,
const sensor_msgs::CameraInfoConstPtr &  camer_info_ 
)
private

Definition at line 177 of file aruco_node.cpp.

void ArUcoNode::publishFiducials ( const std_msgs::Header header,
vector< aruco::Marker > &  markers,
const sensor_msgs::CameraInfoConstPtr &  camer_info_ 
)
private

Definition at line 139 of file aruco_node.cpp.

void ArUcoNode::publishMarkers ( const std_msgs::Header header,
vector< ArUcoMarkerPose > &  markerPoses 
)
private

Definition at line 99 of file aruco_node.cpp.

Member Data Documentation

ArUcoBase ArUcoNode::base_
private

Definition at line 69 of file aruco_node.h.

image_transport::CameraSubscriber ArUcoNode::cameraSubscriber_
private

Definition at line 60 of file aruco_node.h.

dynamic_reconfigure::Server<tuw_aruco::ArUcoConfig>::CallbackType ArUcoNode::configCallbackFnct_
private

Definition at line 67 of file aruco_node.h.

dynamic_reconfigure::Server<tuw_aruco::ArUcoConfig> ArUcoNode::configServer_
private

Definition at line 66 of file aruco_node.h.

image_transport::ImageTransport ArUcoNode::imageTransport_
private

Definition at line 59 of file aruco_node.h.

ros::NodeHandle ArUcoNode::n_
private

Definition at line 57 of file aruco_node.h.

ros::Publisher ArUcoNode::pub_fiducials_
private

Definition at line 64 of file aruco_node.h.

ros::Publisher ArUcoNode::pub_markers_
private

Definition at line 63 of file aruco_node.h.

tf::TransformBroadcaster ArUcoNode::transformBroadcaster_
private

Definition at line 62 of file aruco_node.h.


The documentation for this class was generated from the following files:


tuw_aruco
Author(s): Lukas Pfeifhofer
autogenerated on Mon Jun 10 2019 15:41:03