Go to the documentation of this file.
16 #include <sensor_msgs/Image.h>
17 #include <posedetection_msgs/ImageFeature0D.h>
19 #include <opencv2/highgui/highgui.hpp>
20 #include <boost/shared_ptr.hpp>
34 _sync = boost::make_shared<message_filters::Synchronizer<SyncPolicy> >(100);
43 const posedetection_msgs::Feature0DConstPtr& feature_msg)
49 feature_msg->positions,
51 feature_msg->orientations);
65 msg_ptr->features.positions,
66 msg_ptr->features.scales,
67 msg_ptr->features.orientations);
76 int main(
int argc,
char **argv)
78 ros::init(argc, argv,
"feature0d_to_image");
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
boost::shared_ptr< message_filters::Synchronizer< SyncPolicy > > _sync
ros::Subscriber _sub_imagefeature
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(AdvertiseOptions &ops)
std::string resolveName(const std::string &name, bool remap=true) const
CvImagePtr toCvCopy(const sensor_msgs::CompressedImage &source, const std::string &encoding=std::string())
message_filters::Subscriber< posedetection_msgs::Feature0D > _sub_feature
cv::Mat draw_features(const cv::Mat src, const std::vector< float > positions, const std::vector< float > scales, const std::vector< float > orientations)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, const boost::function< void(C)> &callback, const VoidConstPtr &tracked_object=VoidConstPtr(), const TransportHints &transport_hints=TransportHints())
message_filters::Subscriber< sensor_msgs::Image > _sub_image
int main(int argc, char **argv)
virtual ~Feature0DToImage()
void imagefeature_cb(const posedetection_msgs::ImageFeature0DConstPtr &msg_ptr)