#include <pose_estimation_markermap_node.h>
Public Member Functions | |
| PoseEstimationMarkerMapNode (ros::NodeHandle &n, MarkerMapConfig markerMapConfig) | |
| ~PoseEstimationMarkerMapNode () | |
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 | |
| PoseEstimationMarkerMapBase | 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_markermap_node.h.
| PoseEstimationMarkerMapNode::PoseEstimationMarkerMapNode | ( | ros::NodeHandle & | n, |
| MarkerMapConfig | markerMapConfig | ||
| ) |
Definition at line 110 of file pose_estimation_markermap_node.cpp.
| PoseEstimationMarkerMapNode::~PoseEstimationMarkerMapNode | ( | ) |
Definition at line 122 of file pose_estimation_markermap_node.cpp.
|
private |
Definition at line 221 of file pose_estimation_markermap_node.cpp.
|
private |
Definition at line 124 of file pose_estimation_markermap_node.cpp.
|
private |
Definition at line 183 of file pose_estimation_markermap_node.cpp.
|
private |
Definition at line 62 of file pose_estimation_markermap_node.h.
|
private |
Definition at line 60 of file pose_estimation_markermap_node.h.
|
private |
Definition at line 59 of file pose_estimation_markermap_node.h.
|
private |
Definition at line 54 of file pose_estimation_markermap_node.h.
|
private |
Definition at line 52 of file pose_estimation_markermap_node.h.
|
private |
Definition at line 57 of file pose_estimation_markermap_node.h.
|
private |
Definition at line 56 of file pose_estimation_markermap_node.h.