#include "libuvc_camera/camera_driver.h"
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <std_msgs/Header.h>
#include <image_transport/camera_publisher.h>
#include <dynamic_reconfigure/server.h>
#include <libuvc/libuvc.h>
Go to the source code of this file.
Value:(libuvc_VERSION_MAJOR * 10000 \
+ libuvc_VERSION_MINOR * 100 \
+ libuvc_VERSION_PATCH)
Definition at line 42 of file camera_driver.cpp.
#define PARAM_INT |
( |
|
name, |
|
|
|
fn, |
|
|
|
value |
|
) |
| |
Value:if (new_config.name != config_.name) { \
int val = (value); \
if (uvc_set_##fn(devh_, val)) { \
ROS_WARN("Unable to set " #name " to %d", val); \
new_config.name = config_.name; \
} \
}