Skip to content

Commit

Permalink
Merge pull request #5 from ros-perception/ros2_pkg
Browse files Browse the repository at this point in the history
Create package and CI
  • Loading branch information
SteveMacenski authored Jun 10, 2020
2 parents 9ac4d3c + 2430bde commit b62cd6b
Show file tree
Hide file tree
Showing 3 changed files with 67 additions and 0 deletions.
27 changes: 27 additions & 0 deletions .circleci/config.yml
Original file line number Diff line number Diff line change
@@ -0,0 +1,27 @@
version: 2
jobs:
foxy:
docker:
- image: ros:foxy
steps:
- checkout
- run:
name: Set Up Container
command: |
apt update -qq && apt install -y build-essential cmake python3-colcon-common-extensions python3-rosdep python3-pip
pip3 install --upgrade pytest
apt upgrade -y
source `find /opt/ros -maxdepth 2 -name local_setup.bash | sort | head -1`
mkdir -p src/radar_msgs && mv `find -maxdepth 1 -not -name . -not -name src` src/radar_msgs/
rosdep update
rosdep install -y --ignore-src --from-paths src
- run:
name: Build
command: |
source `find /opt/ros -maxdepth 2 -name local_setup.bash | sort | head -1`
colcon build --parallel-workers 1
workflows:
version: 2
ros_build:
jobs:
- foxy
19 changes: 19 additions & 0 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
@@ -0,0 +1,19 @@
cmake_minimum_required(VERSION 3.5)
project(radar_msgs)

find_package(ament_cmake REQUIRED)
find_package(builtin_interfaces REQUIRED)
find_package(rosidl_default_generators REQUIRED)
find_package(std_msgs REQUIRED)

nav2_package()

rosidl_generate_interfaces(${PROJECT_NAME}
"msg/RadarReturn.msg"
"msg/RadarScan.msg"
DEPENDENCIES builtin_interfaces std_msgs action_msgs nav_msgs
)

ament_export_dependencies(rosidl_default_runtime)

ament_package()
21 changes: 21 additions & 0 deletions package.xml
Original file line number Diff line number Diff line change
@@ -0,0 +1,21 @@
<?xml version="1.0"?>
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="3">
<name>radar_msgs</name>
<version>0.1.0</version>
<description>Standard ROS messages for radars</description>
<maintainer email="[email protected]">Steve Macenski</maintainer>
<license>Apache-2.0</license>

<buildtool_depend>ament_cmake</buildtool_depend>

<depend>std_msgs</depend>
<depend>rosidl_default_generators</depend>
<depend>builtin_interfaces</depend>

<member_of_group>rosidl_interface_packages</member_of_group>

<export>
<build_type>ament_cmake</build_type>
</export>
</package>

0 comments on commit b62cd6b

Please sign in to comment.