[ros-users] Can't access to Firewire camera

Gary Bradski bradski at willowgarage.com
Wed May 19 16:41:45 UTC 2010


You don't say what your OS is . This might be an ffmpeg problem, try
reinstalling it.  See http://opencv.willowgarage.com/wiki/FFMPEG


On Tue, May 18, 2010 at 12:04 PM, Akansel Cosgun
<akansel.cosgun at gmail.com>wrote:

> Hi everyone,
>
> 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:
>
> #include <ros/ros.h>
> #include <opencv/highgui.h>
> #include <cv_bridge/CvBridge.h>
> #include "sensor_msgs/Image.h"
> int main(int argc, char** argv)
> {
>   ros::init(argc, argv, "image_broadcaster");
>   ros::NodeHandle nh;
>   CvCapture* cam = cvCaptureFromCAM(-1);
>   if (!cam)
>  {
>     ROS_ERROR("cv_image_broadcaster reports: Cannot get the CAM");
>     exit(-1);
>   }
>  ...
>  ...
> }
>
> The camera isn't recognized as the compiler says: "cv_image_broadcaster
> reports: Cannot get the CAM"
>
> manifest.xml:
> <package>
>   <description brief="image_broadcaster">
>
>      image_broadcaster
>
>   </description>
>   <author>Akansel Cosgun</author>
>   <license>BSD</license>
>   <review status="unreviewed" notes=""/>
>   <url>http://ros.org/wiki/image_broadcaster</url>
>   <depend package="roscpp"/>
>   <depend package="sensor_msgs"/>
>   <depend package="cv_bridge"/>
>   <depend package="opencv2"/>
> </package>
>
> What do you think might be the problem?
>
> Thanks
>
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
>
>
-------------- next part --------------
An HTML attachment was scrubbed...
URL: <http://lists.ros.org/pipermail/ros-users/attachments/20100519/39652d3d/attachment-0003.html>


More information about the ros-users mailing list