Robotics StackExchange | Archived questions

problem with cv_bridge

Hi dear I tried to follow cvbridge example for this I ran cvcamera to get image from webcam and ran the example of cv_bridge but the example couldn't subscribe any message. the example program:

#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>

static const std::string OPENCV_WINDOW = "Image window";

class ImageConverter
{
  ros::NodeHandle nh_;
  image_transport::ImageTransport it_;
  image_transport::Subscriber image_sub_;
  image_transport::Publisher image_pub_;

public:
  ImageConverter()
    : it_(nh_)
  {
    // Subscrive to input video feed and publish output video feed
    image_sub_ = it_.subscribe("/camera/image_raw", 100,
      &ImageConverter::imageCb, this);
    image_pub_ = it_.advertise("/image_converter/output_video", 1);

    cv::namedWindow(OPENCV_WINDOW);
  }

  ~ImageConverter()
  {
    cv::destroyWindow(OPENCV_WINDOW);
  }

  void imageCb(const sensor_msgs::ImageConstPtr& msg)
  {
        ROS_INFO("SSS");
      cv_bridge::CvImagePtr cv_ptr;
    try
    {
      cv_ptr = cv_bridge::toCvCopy(msg, sensor_msgs::image_encodings::BGR8);
    }
    catch (cv_bridge::Exception& e)
    {
      ROS_ERROR("cv_bridge exception: %s", e.what());
      return;
    }

    // Draw an example circle on the video stream
    if (cv_ptr->image.rows > 60 && cv_ptr->image.cols > 60)
      cv::circle(cv_ptr->image, cv::Point(50, 50), 10, CV_RGB(255,0,0));

    // Update GUI Window
    cv::imshow(OPENCV_WINDOW, cv_ptr->image);
    cv::waitKey(3);

    // Output modified video stream
    image_pub_.publish(cv_ptr->toImageMsg());
  }
};

int main(int argc, char** argv)
{
  ros::init(argc, argv, "image_converter");
  ImageConverter ic;
  ros::spin();
  return 0;
}

could some one help me? I'm using ubuntu 12.10 and hydro

Asked by Hamid Didari on 2013-11-27 22:38:24 UTC

Comments

When you run cv_camera, does the topic "/camera/image_raw" show up when you do a "$rostopic list"?

Asked by Angus on 2013-11-28 18:22:28 UTC

yes,I subscribe the image in rviz

Asked by Hamid Didari on 2013-11-29 02:47:22 UTC

Did you troubleshoot with image_view? http://wiki.ros.org/image_view

Asked by TFinleyosu on 2014-02-11 13:11:24 UTC

I can subscribe image in rviz .but this program can't subscribe the image. I do not have output from my node. I try cv_bridge in another program work very well but this program doesn't work.

Asked by Hamid Didari on 2014-02-11 20:57:49 UTC

Answers