stereo_camera_node.cpp
Go to the documentation of this file.
00001 #include <ros/ros.h>
00002 #include <boost/thread.hpp>
00003 #include <avt_vimba_camera/stereo_camera.h>
00004 
00005 int main(int argc, char** argv)
00006 {
00007         ros::init(argc, argv, "stereo_camera_node");
00008 
00009   ros::NodeHandle nh;
00010   ros::NodeHandle nhp("~");
00011 
00012   avt_vimba_camera::StereoCamera sc(nh,nhp);
00013   boost::thread stereoThread(&avt_vimba_camera::StereoCamera::run, &sc);
00014 
00015   // ROS spin
00016   ros::Rate r(10);
00017   while (ros::ok())
00018     r.sleep();
00019   ros::shutdown();
00020 
00021   return 0;
00022 }


avt_vimba_camera
Author(s): Miquel Massot , Allied Vision Technologies
autogenerated on Thu Jun 6 2019 18:23:39