Skip to content

Commit

Permalink
initial catkin conversion
Browse files Browse the repository at this point in the history
  • Loading branch information
jack-oquin committed Mar 9, 2013
1 parent 067115e commit 24aa585
Show file tree
Hide file tree
Showing 4 changed files with 37 additions and 34 deletions.
25 changes: 17 additions & 8 deletions CMakeLists.txt
@@ -1,10 +1,19 @@
cmake_minimum_required(VERSION 2.4.6)
include($ENV{ROS_ROOT}/core/rosbuild/rosbuild.cmake)
cmake_minimum_required(VERSION 2.8.3)
project(ackermann_msgs)

rosbuild_init()
rosbuild_make_distribution(0.4.0)
find_package(catkin REQUIRED COMPONENTS message_generation std_msgs)
# We want boost/format.hpp, which isn't in its own component.
find_package(Boost REQUIRED)

#uncomment if you have defined messages
rosbuild_genmsg()
#uncomment if you have defined services
#rosbuild_gensrv()
include_directories(include)

add_message_files(
DIRECTORY msg
FILES AckermannDrive.msg AckermannDriveStamped.msg)

generate_messages(DEPENDENCIES std_msgs)

catkin_package(
INCLUDE_DIRS include
CATKIN_DEPENDS message_runtime std_msgs
DEPENDS Boost)
14 changes: 0 additions & 14 deletions manifest.xml

This file was deleted.

20 changes: 20 additions & 0 deletions package.xml
@@ -0,0 +1,20 @@
<package>
<name>ackermann_msgs</name>
<version>0.9.0</version>
<description>
ROS messages for robots using Ackermann steering.
</description>
<maintainer email="jack.oquin@gmail.com">Jack O'Quin</maintainer>
<author>Jack O'Quin</author>
<license>BSD</license>

<url>http://ros.org/wiki/ackermann_msgs</url>

<buildtool_depend>catkin</buildtool_depend>

<build_depend>message_generation</build_depend>
<build_depend>std_msgs</build_depend>

<run_depend>message_runtime</run_depend>
<run_depend>std_msgs</run_depend>
</package>
12 changes: 0 additions & 12 deletions stack.xml

This file was deleted.

0 comments on commit 24aa585

Please sign in to comment.