Go to the documentation of this file.00001
00002
00003 #include "cv_camera/driver.h"
00004
00005 int main(int argc, char**argv)
00006 {
00007 ros::init(argc, argv, "cv_camera");
00008 ros::NodeHandle private_node("~");
00009 cv_camera::Driver driver(private_node, private_node);
00010
00011 try
00012 {
00013 driver.setup();
00014 while (ros::ok())
00015 {
00016 driver.proceed();
00017 ros::spinOnce();
00018 }
00019 }
00020 catch (cv_camera::DeviceError &e)
00021 {
00022 ROS_ERROR_STREAM("cv camera open failed: " << e.what());
00023 return 1;
00024 }
00025
00026 return 0;
00027 }