BSD 3-Clause "New" or "Revised" License
76
stars
66
forks
source link
I'd like to know if i want information fusion between two built-in interfaces(like sensor_msg/image and geomory_msg/pose). Is there an example? #70
Closed
boyuandeng closed 2 years ago
in ros1,i can typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, geometry_msgs::PoseStamped> SyncPolicyImagePose; typedef shared_ptr<message_filters::Synchronizer> SynchronizerImagePose;
SynchronizerImagePose sync_imagepose;
sync_imagepose.reset(new message_filters::Synchronizer(
SyncPolicyImagePose(100), depthsub, posesub));
sync_imagepose->registerCallback(boost::bind(&depthPoseCallback, this, _1, _2));