ROS driver for IIDC-compatible IEEE 1394 digital cameras. More...
#include <boost/format.hpp>
#include <driver_base/SensorLevels.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "std_msgs/Header.h"
#include <iostream>
#include <iomanip>
#include <cmath>
#include <sstream>
#include <map>
#include <stdexcept>
#include <list>
#include <boost/thread/mutex.hpp>
#include "geometry_msgs/Vector3.h"
#include "geometry_msgs/Quaternion.h"
#include "geometry_msgs/TransformStamped.h"
#include "geometry_msgs/Point.h"
#include "btMatrix3x3.h"
#include "ros/console.h"
#include "tf/exceptions.h"
#include "LinearMath/btTransform.h"
#include <boost/signals.hpp>
#include "ros/ros.h"
#include <boost/shared_ptr.hpp>
#include "ros/types.h"
#include <boost/thread/shared_mutex.hpp>
#include <boost/thread/condition_variable.hpp>
#include <boost/thread/tss.hpp>
#include <deque>
#include "ros/service_traits.h"
#include "boost/thread.hpp"
#include "driver1394.h"
#include "camera1394/Camera1394Config.h"
#include "features.h"
Go to the source code of this file.
Namespaces | |
namespace | camera1394_driver |
Typedefs | |
typedef camera1394::Camera1394Config | camera1394_driver::Config |
typedef driver_base::Driver | camera1394_driver::Driver |
typedef driver_base::SensorLevels | camera1394_driver::Levels |
ROS driver for IIDC-compatible IEEE 1394 digital cameras.
This is a ROS driver for 1394 cameras, using libdc1394. It can be instantiated as either a node or a nodelet. It is written with with minimal dependencies, intended to fill a role in the ROS image pipeline similar to the other ROS camera drivers.
Definition in file driver1394.cpp.