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

#include <pose_estimation_node.h>

Public Member Functions

 PoseEstimationNode (ros::NodeHandle &n)
 
 ~PoseEstimationNode ()
 

Private Member Functions

void configCallback (tuw_marker_pose_estimation::MarkerPoseEstimationConfig &config, uint32_t level)
 
void fiducialDetectionCallback (const marker_msgs::FiducialDetection::ConstPtr &msg)
 
void publishMarkers (const std_msgs::Header &header, std::vector< MarkerPose > &markerPoses)
 

Private Attributes

PoseEstimationBase base_
 
dynamic_reconfigure::Server< tuw_marker_pose_estimation::MarkerPoseEstimationConfig >::CallbackType configCallbackFnct_
 
dynamic_reconfigure::Server< tuw_marker_pose_estimation::MarkerPoseEstimationConfig > configServer_
 
ros::Subscriber fiducialDetectionSubscriber_
 
ros::NodeHandle n_
 
ros::Publisher pub_markers_
 
tf::TransformBroadcaster transformBroadcaster_
 

Detailed Description

Definition at line 45 of file pose_estimation_node.h.

Constructor & Destructor Documentation

PoseEstimationNode::PoseEstimationNode ( ros::NodeHandle n)

Definition at line 42 of file pose_estimation_node.cpp.

PoseEstimationNode::~PoseEstimationNode ( )

Definition at line 54 of file pose_estimation_node.cpp.

Member Function Documentation

void PoseEstimationNode::configCallback ( tuw_marker_pose_estimation::MarkerPoseEstimationConfig &  config,
uint32_t  level 
)
private

Definition at line 153 of file pose_estimation_node.cpp.

void PoseEstimationNode::fiducialDetectionCallback ( const marker_msgs::FiducialDetection::ConstPtr &  msg)
private

Definition at line 56 of file pose_estimation_node.cpp.

void PoseEstimationNode::publishMarkers ( const std_msgs::Header header,
std::vector< MarkerPose > &  markerPoses 
)
private

Definition at line 115 of file pose_estimation_node.cpp.

Member Data Documentation

PoseEstimationBase PoseEstimationNode::base_
private

Definition at line 62 of file pose_estimation_node.h.

dynamic_reconfigure::Server<tuw_marker_pose_estimation::MarkerPoseEstimationConfig>::CallbackType PoseEstimationNode::configCallbackFnct_
private

Definition at line 60 of file pose_estimation_node.h.

dynamic_reconfigure::Server<tuw_marker_pose_estimation::MarkerPoseEstimationConfig> PoseEstimationNode::configServer_
private

Definition at line 59 of file pose_estimation_node.h.

ros::Subscriber PoseEstimationNode::fiducialDetectionSubscriber_
private

Definition at line 54 of file pose_estimation_node.h.

ros::NodeHandle PoseEstimationNode::n_
private

Definition at line 52 of file pose_estimation_node.h.

ros::Publisher PoseEstimationNode::pub_markers_
private

Definition at line 57 of file pose_estimation_node.h.

tf::TransformBroadcaster PoseEstimationNode::transformBroadcaster_
private

Definition at line 56 of file pose_estimation_node.h.


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


tuw_marker_pose_estimation
Author(s): Lukas Pfeifhofer
autogenerated on Mon Jun 10 2019 15:42:13