#include <pose_estimation_combomarker_node.h>
Public Member Functions | |
| PoseEstimationComboMarkerNode (ros::NodeHandle &n) | |
| ~PoseEstimationComboMarkerNode () | |
Private Member Functions | |
| void | publishMarkers (const std_msgs::Header &header, std::vector< MarkerPose > &markerPoses) |
| void | synchronizedFiducialsCallback (const marker_msgs::FiducialDetection::ConstPtr &msgIdFiducialDetection, const marker_msgs::FiducialDetection::ConstPtr &msgEllipseFiducialDetection) |
Private Attributes | |
| message_filters::Subscriber< marker_msgs::FiducialDetection > | ellipseFiducialDetectionSubscriber_ |
| message_filters::Subscriber< marker_msgs::FiducialDetection > | idFiducialDetectionSubscriber_ |
| ros::NodeHandle | n_ |
| ros::Publisher | pub_markers_ |
| message_filters::TimeSynchronizer< marker_msgs::FiducialDetection, marker_msgs::FiducialDetection > | sync_ |
| tf::TransformBroadcaster | transformBroadcaster_ |
Definition at line 45 of file pose_estimation_combomarker_node.h.
| PoseEstimationComboMarkerNode::PoseEstimationComboMarkerNode | ( | ros::NodeHandle & | n | ) |
Definition at line 49 of file pose_estimation_combomarker_node.cpp.
| PoseEstimationComboMarkerNode::~PoseEstimationComboMarkerNode | ( | ) |
Definition at line 59 of file pose_estimation_combomarker_node.cpp.
|
private |
Definition at line 270 of file pose_estimation_combomarker_node.cpp.
|
private |
Definition at line 62 of file pose_estimation_combomarker_node.cpp.
|
private |
Definition at line 58 of file pose_estimation_combomarker_node.h.
|
private |
Definition at line 57 of file pose_estimation_combomarker_node.h.
|
private |
Definition at line 52 of file pose_estimation_combomarker_node.h.
|
private |
Definition at line 55 of file pose_estimation_combomarker_node.h.
|
private |
Definition at line 60 of file pose_estimation_combomarker_node.h.
|
private |
Definition at line 54 of file pose_estimation_combomarker_node.h.