#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_ |
Definition at line 45 of file pose_estimation_node.h.
| 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.
|
private |
Definition at line 153 of file pose_estimation_node.cpp.
|
private |
Definition at line 56 of file pose_estimation_node.cpp.
|
private |
Definition at line 115 of file pose_estimation_node.cpp.
|
private |
Definition at line 62 of file pose_estimation_node.h.
|
private |
Definition at line 60 of file pose_estimation_node.h.
|
private |
Definition at line 59 of file pose_estimation_node.h.
|
private |
Definition at line 54 of file pose_estimation_node.h.
|
private |
Definition at line 52 of file pose_estimation_node.h.
|
private |
Definition at line 57 of file pose_estimation_node.h.
|
private |
Definition at line 56 of file pose_estimation_node.h.