You don't say what your OS is . This might be an ffmpeg problem, try reinstalling it.  See <a href="http://opencv.willowgarage.com/wiki/FFMPEG">http://opencv.willowgarage.com/wiki/FFMPEG</a><br><br><br><div class="gmail_quote">
On Tue, May 18, 2010 at 12:04 PM, Akansel Cosgun <span dir="ltr"><<a href="mailto:akansel.cosgun@gmail.com">akansel.cosgun@gmail.com</a>></span> wrote:<br><blockquote class="gmail_quote" style="border-left: 1px solid rgb(204, 204, 204); margin: 0pt 0pt 0pt 0.8ex; padding-left: 1ex;">
Hi everyone,<br><br>I wrote a node to broadcast the images into the network. I recently re-installed opencv2 and the samples are working with the firewire
camera as well as the coriander application. However I wasn't able to
run with this simple code up here:<br><br>#include <ros/ros.h><br>#include <opencv/highgui.h><br>#include <cv_bridge/CvBridge.h><br>
#include "sensor_msgs/Image.h"<br>int main(int argc, char** argv)<br>{<br>  ros::init(argc, argv, "image_broadcaster");<br>  ros::NodeHandle nh;<br>  CvCapture* cam = cvCaptureFromCAM(-1);<br>  if (!cam) <br>


 {<br>    ROS_ERROR("cv_image_broadcaster reports: Cannot get the CAM");<br>    exit(-1);<br>  }<br> ...<br> ...<br>}<br><br>The camera isn't recognized as the compiler says: "cv_image_broadcaster reports: Cannot get the CAM"<br>

<br>manifest.xml:<br><package><br>  <description brief="image_broadcaster"><br><br>     image_broadcaster<br><br>  </description><br>  <author>Akansel Cosgun</author><br>  <license>BSD</license><br>

  <review status="unreviewed" notes=""/><br>  <url><a href="http://ros.org/wiki/image_broadcaster" target="_blank">http://ros.org/wiki/image_broadcaster</a></url><br>  <depend package="roscpp"/><br>

  <depend package="sensor_msgs"/><br>  <depend package="cv_bridge"/><br>  <depend package="opencv2"/><br></package><br><br>What do you think might be the problem?<br>
<br>
Thanks<br>
<br>_______________________________________________<br>
ros-users mailing list<br>
<a href="mailto:ros-users@code.ros.org">ros-users@code.ros.org</a><br>
<a href="https://code.ros.org/mailman/listinfo/ros-users" target="_blank">https://code.ros.org/mailman/listinfo/ros-users</a><br>
<br></blockquote></div><br>