17 #include <posedetection_msgs/ImageFeature0D.h> 19 #include <opencv2/highgui/highgui.hpp> 20 #include <boost/shared_ptr.hpp> 32 local_nh.
param(
"autosize", autosize,
false);
35 cvNamedWindow(
_window_name.c_str(), autosize ? CV_WINDOW_AUTOSIZE : 0);
36 cvStartWindowThread();
46 msg_ptr->features.positions,
47 msg_ptr->features.scales,
48 msg_ptr->features.orientations);
58 int main(
int argc,
char **argv)
void image_cb(const posedetection_msgs::ImageFeature0DConstPtr &msg_ptr)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
std::string resolveName(const std::string &name, bool remap=true) const
int main(int argc, char **argv)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ROSCPP_DECL void spin(Spinner &spinner)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
cv::Mat draw_features(const cv::Mat src, const std::vector< float > positions, const std::vector< float > scales, const std::vector< float > orientations)
CvImagePtr toCvCopy(const sensor_msgs::ImageConstPtr &source, const std::string &encoding=std::string())