Skip to content

Commit

Permalink
Merge branch 'hydro-devel' of github.com:bosch-ros-pkg/usb_cam
Browse files Browse the repository at this point in the history
  • Loading branch information
rctoris committed Jul 28, 2014
2 parents 86f6bc3 + ae7dcd9 commit 37603b9
Show file tree
Hide file tree
Showing 4 changed files with 3 additions and 6 deletions.
2 changes: 0 additions & 2 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -6,7 +6,6 @@ find_package(catkin
roscpp
std_msgs
sensor_msgs
self_test
camera_info_manager)


Expand All @@ -25,7 +24,6 @@ catkin_package(
roscpp
std_msgs
sensor_msgs
self_test
camera_info_manager
)

Expand Down
2 changes: 1 addition & 1 deletion nodes/usb_cam_node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -39,7 +39,7 @@
#include <ros/ros.h>
#include <sensor_msgs/fill_image.h>
#include <usb_cam/usb_cam.h>
#include <self_test/self_test.h>
//#include <self_test/self_test.h>
#include <image_transport/image_transport.h>

#include <camera_info_manager/camera_info_manager.h>
Expand Down
4 changes: 1 addition & 3 deletions package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>usb_cam</name>
<version>0.1.3</version>
<version>0.1.4</version>
<description>A generic driver for USB camera that are supported by V4L</description>

<license>BSD</license>
Expand All @@ -18,15 +18,13 @@
<build_depend>roscpp</build_depend>
<build_depend>std_msgs</build_depend>
<build_depend>sensor_msgs</build_depend>
<build_depend>self_test</build_depend>
<build_depend>ffmpeg</build_depend>
<build_depend>camera_info_manager</build_depend>

<run_depend>image_transport</run_depend>
<run_depend>roscpp</run_depend>
<run_depend>std_msgs</run_depend>
<run_depend>sensor_msgs</run_depend>
<run_depend>self_test</run_depend>
<run_depend>ffmpeg</run_depend>
<run_depend>camera_info_manager</run_depend>

Expand Down
1 change: 1 addition & 0 deletions src/usb_cam.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -54,6 +54,7 @@ extern "C" {
#include <linux/videodev2.h>
#include <libavcodec/avcodec.h>
#include <libswscale/swscale.h>
#include <libavutil/mem.h>
}

#include <ros/ros.h>
Expand Down

0 comments on commit 37603b9

Please sign in to comment.