ROS driver interface for IIDC-compatible IEEE 1394 digital cameras. More...
#include <boost/thread/mutex.hpp>
#include <ros/ros.h>
#include <camera_info_manager/camera_info_manager.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include <dynamic_reconfigure/server.h>
#include <image_transport/image_transport.h>
#include <sensor_msgs/CameraInfo.h>
#include "dev_camera1394.h"
#include "camera1394/Camera1394Config.h"
#include "camera1394/GetCameraRegisters.h"
#include "camera1394/SetCameraRegisters.h"
Go to the source code of this file.
Classes | |
class | camera1394_driver::Camera1394Driver |
class | camera1394_driver::Levels |
Namespaces | |
namespace | camera1394_driver |
Typedefs | |
typedef camera1394::Camera1394Config | Config |
ROS driver interface for IIDC-compatible IEEE 1394 digital cameras.
Definition in file driver1394.h.
typedef camera1394::Camera1394Config Config |
Definition at line 53 of file driver1394.h.