Public Member Functions | Private Member Functions | Private Attributes | List of all members
ArucoDetect Class Reference
Inheritance diagram for ArucoDetect:
Inheritance graph
[legend]

Public Member Functions

virtual void onInit ()
 
- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 

Private Member Functions

void fillCorners (aruco_pose::Marker &marker, const vector< cv::Point2f > &corners) const
 
void fillPose (geometry_msgs::Pose &pose, const cv::Vec3d &rvec, const cv::Vec3d &tvec) const
 
void fillTranslation (geometry_msgs::Vector3 &translation, const cv::Vec3d &tvec) const
 
std::string getChildFrameId (int id) const
 
double getMarkerLength (int id)
 
void imageCallback (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &cinfo)
 
void mapMarkersCallback (const aruco_pose::MarkerArray &msg)
 
void paramCallback (aruco_pose::DetectorConfig &config, uint32_t level)
 
void pushVisMarkers (const std::string &frame_id, const ros::Time &stamp, const geometry_msgs::Pose &pose, double length, int id, int index)
 
void readLengthOverride (ros::NodeHandle &nh)
 

Private Attributes

aruco_pose::MarkerArray array_
 
bool auto_flip_
 
std::unique_ptr< tf2_ros::TransformBroadcasterbr_
 
Mat camera_matrix_
 
image_transport::Publisher debug_pub_
 
cv::Ptr< cv::aruco::Dictionarydictionary_
 
Mat dist_coeffs_
 
std::shared_ptr< dynamic_reconfigure::Server< aruco_pose::DetectorConfig > > dyn_srv_
 
bool enabled_ = true
 
bool estimate_poses_
 
std::string frame_id_prefix_
 
image_transport::CameraSubscriber img_sub_
 
std::string known_tilt_
 
double length_
 
std::unordered_map< int, double > length_override_
 
std::unordered_set< int > map_markers_ids_
 
ros::Subscriber map_markers_sub_
 
ros::Publisher markers_pub_
 
cv::Ptr< cv::aruco::DetectorParametersparameters_
 
bool send_tf_
 
std::unique_ptr< tf2_ros::Buffertf_buffer_
 
std::unique_ptr< tf2_ros::TransformListenertf_listener_
 
visualization_msgs::MarkerArray vis_array_
 
ros::Publisher vis_markers_pub_
 

Additional Inherited Members

- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 59 of file aruco_detect.cpp.

Member Function Documentation

◆ fillCorners()

void ArucoDetect::fillCorners ( aruco_pose::Marker &  marker,
const vector< cv::Point2f > &  corners 
) const
inlineprivate

Definition at line 256 of file aruco_detect.cpp.

◆ fillPose()

void ArucoDetect::fillPose ( geometry_msgs::Pose pose,
const cv::Vec3d &  rvec,
const cv::Vec3d &  tvec 
) const
inlineprivate

Definition at line 268 of file aruco_detect.cpp.

◆ fillTranslation()

void ArucoDetect::fillTranslation ( geometry_msgs::Vector3 &  translation,
const cv::Vec3d &  tvec 
) const
inlineprivate

Definition at line 286 of file aruco_detect.cpp.

◆ getChildFrameId()

std::string ArucoDetect::getChildFrameId ( int  id) const
inlineprivate

Definition at line 328 of file aruco_detect.cpp.

◆ getMarkerLength()

double ArucoDetect::getMarkerLength ( int  id)
inlineprivate

Definition at line 342 of file aruco_detect.cpp.

◆ imageCallback()

void ArucoDetect::imageCallback ( const sensor_msgs::ImageConstPtr &  msg,
const sensor_msgs::CameraInfoConstPtr &  cinfo 
)
inlineprivate

Definition at line 130 of file aruco_detect.cpp.

◆ mapMarkersCallback()

void ArucoDetect::mapMarkersCallback ( const aruco_pose::MarkerArray &  msg)
inlineprivate

Definition at line 352 of file aruco_detect.cpp.

◆ onInit()

virtual void ArucoDetect::onInit ( )
inlinevirtual

Implements nodelet::Nodelet.

Definition at line 82 of file aruco_detect.cpp.

◆ paramCallback()

void ArucoDetect::paramCallback ( aruco_pose::DetectorConfig &  config,
uint32_t  level 
)
inlineprivate

Definition at line 360 of file aruco_detect.cpp.

◆ pushVisMarkers()

void ArucoDetect::pushVisMarkers ( const std::string &  frame_id,
const ros::Time stamp,
const geometry_msgs::Pose pose,
double  length,
int  id,
int  index 
)
inlineprivate

Definition at line 293 of file aruco_detect.cpp.

◆ readLengthOverride()

void ArucoDetect::readLengthOverride ( ros::NodeHandle nh)
inlineprivate

Definition at line 333 of file aruco_detect.cpp.

Member Data Documentation

◆ array_

aruco_pose::MarkerArray ArucoDetect::array_
private

Definition at line 77 of file aruco_detect.cpp.

◆ auto_flip_

bool ArucoDetect::auto_flip_
private

Definition at line 72 of file aruco_detect.cpp.

◆ br_

std::unique_ptr<tf2_ros::TransformBroadcaster> ArucoDetect::br_
private

Definition at line 61 of file aruco_detect.cpp.

◆ camera_matrix_

Mat ArucoDetect::camera_matrix_
private

Definition at line 76 of file aruco_detect.cpp.

◆ debug_pub_

image_transport::Publisher ArucoDetect::debug_pub_
private

Definition at line 68 of file aruco_detect.cpp.

◆ dictionary_

cv::Ptr<cv::aruco::Dictionary> ArucoDetect::dictionary_
private

Definition at line 66 of file aruco_detect.cpp.

◆ dist_coeffs_

Mat ArucoDetect::dist_coeffs_
private

Definition at line 76 of file aruco_detect.cpp.

◆ dyn_srv_

std::shared_ptr<dynamic_reconfigure::Server<aruco_pose::DetectorConfig> > ArucoDetect::dyn_srv_
private

Definition at line 64 of file aruco_detect.cpp.

◆ enabled_

bool ArucoDetect::enabled_ = true
private

Definition at line 65 of file aruco_detect.cpp.

◆ estimate_poses_

bool ArucoDetect::estimate_poses_
private

Definition at line 72 of file aruco_detect.cpp.

◆ frame_id_prefix_

std::string ArucoDetect::frame_id_prefix_
private

Definition at line 75 of file aruco_detect.cpp.

◆ img_sub_

image_transport::CameraSubscriber ArucoDetect::img_sub_
private

Definition at line 69 of file aruco_detect.cpp.

◆ known_tilt_

std::string ArucoDetect::known_tilt_
private

Definition at line 75 of file aruco_detect.cpp.

◆ length_

double ArucoDetect::length_
private

Definition at line 73 of file aruco_detect.cpp.

◆ length_override_

std::unordered_map<int, double> ArucoDetect::length_override_
private

Definition at line 74 of file aruco_detect.cpp.

◆ map_markers_ids_

std::unordered_set<int> ArucoDetect::map_markers_ids_
private

Definition at line 78 of file aruco_detect.cpp.

◆ map_markers_sub_

ros::Subscriber ArucoDetect::map_markers_sub_
private

Definition at line 71 of file aruco_detect.cpp.

◆ markers_pub_

ros::Publisher ArucoDetect::markers_pub_
private

Definition at line 70 of file aruco_detect.cpp.

◆ parameters_

cv::Ptr<cv::aruco::DetectorParameters> ArucoDetect::parameters_
private

Definition at line 67 of file aruco_detect.cpp.

◆ send_tf_

bool ArucoDetect::send_tf_
private

Definition at line 72 of file aruco_detect.cpp.

◆ tf_buffer_

std::unique_ptr<tf2_ros::Buffer> ArucoDetect::tf_buffer_
private

Definition at line 62 of file aruco_detect.cpp.

◆ tf_listener_

std::unique_ptr<tf2_ros::TransformListener> ArucoDetect::tf_listener_
private

Definition at line 63 of file aruco_detect.cpp.

◆ vis_array_

visualization_msgs::MarkerArray ArucoDetect::vis_array_
private

Definition at line 79 of file aruco_detect.cpp.

◆ vis_markers_pub_

ros::Publisher ArucoDetect::vis_markers_pub_
private

Definition at line 70 of file aruco_detect.cpp.


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


aruco_pose
Author(s): Oleg Kalachev
autogenerated on Mon Feb 28 2022 22:08:24