[ros-users] Does cturtle not have everything boxturtle does?
Soonhac Hong
soonhac.hong at gmail.com
Fri Aug 6 14:57:40 UTC 2010
Hi Garratt,
I'm forwarding the Patrick Beeson's email as follows.
Quick set of simple patches to make your code compile against C-turtle:
Index: manifest.xml
===================================================================
--- manifest.xml (revision 17)
+++ manifest.xml (working copy)
@@ -11,7 +11,7 @@
<depend package="tf"/>
<depend package="camera_info_manager"/>
<depend package="dynamic_reconfigure"/>
- <depend package="libdc1394v2"/>
+ <rosdep name="libdc1394-dev"/>
</package>
Index: src/bumblebee2.cpp
===================================================================
--- src/bumblebee2.cpp (revision 17)
+++ src/bumblebee2.cpp (working copy)
@@ -52,7 +52,7 @@
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/image_encodings.h>
#include <tf/transform_listener.h>
-#include <camera_info_manager/camera_info.h>
+#include <camera_info_manager/camera_info_manager.h>
#include <image_transport/image_transport.h>
#include <dynamic_reconfigure/server.h>
#include <dynamic_reconfigure/SensorLevels.h>
Index: src/dev_camera1394.cpp
===================================================================
--- src/dev_camera1394.cpp (revision 17)
+++ src/dev_camera1394.cpp (working copy)
@@ -34,6 +34,7 @@
#include <stdint.h>
#include <sensor_msgs/image_encodings.h>
+#include <dc1394/dc1394.h>
#include "bumblebee2.h"
Index: CMakeLists.txt
===================================================================
--- CMakeLists.txt (revision 17)
+++ CMakeLists.txt (working copy)
@@ -33,6 +33,6 @@
#rosbuild_add_boost_directories()
#rosbuild_link_boost(${PROJECT_NAME} thread)
#rosbuild_add_executable(example examples/example.cpp)
-#target_link_libraries(example ${PROJECT_NAME})
+rosbuild_add_executable(${PROJECT_NAME} src/bumblebee2.cpp
src/dev_camera1394.cpp)
-rosbuild_add_executable(${PROJECT_NAME} src/bumblebee2.cpp
src/dev_camera1394.cpp)
+target_link_libraries(${PROJECT_NAME} dc1394)
I hope it will be what you find.
Best,
Soonhac
On 8/6/2010 10:49 AM, garratt wrote:
> I'm trying to get the bumblebee2 driver working, and I noticed that
> cturtle doesn't have all the packages that boxturtle did:
>> svn list
> https://code.ros.org/svn/ros-pkg/branches/trunk_boxturtle/stacks/camera_drivers_experimental
> CMakeLists.txt
> Makefile
> camera1394/
> camera_info_manager/
> libdc1394v2/
> rosdep.yaml
> stack.xml
> swissranger_camera/
>
>> svn list
> https://code.ros.org/svn/ros-pkg/branches/trunk_cturtle/stacks/camera_drivers_experimental
> CMakeLists.txt
> Makefile
> rosdep.yaml
> stack.xml
> swissranger_camera/
>
>
> Now, camera_info_manager moved to the normal camera_drivers directory,
> but I can't find libdc1394v2 anywhere in cturtle. Did the libdc1394v2
> driver move somewhere I have not looked, did it get rolled into
> something else, or do I have to check out boxturtle_trunk to be able to
> access the full set of packages?
>
>
> Thanks
> Garratt
>
>
>
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
>
More information about the ros-users
mailing list