Skip to content

Commit

Permalink
Merge pull request #2 from mlautman/ros2-port-fixup
Browse files Browse the repository at this point in the history
ros2-port fixup
  • Loading branch information
ahcorde authored Mar 14, 2019
2 parents 22938f7 + 69e6cf5 commit 63e5481
Show file tree
Hide file tree
Showing 2 changed files with 17 additions and 20 deletions.
4 changes: 4 additions & 0 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -98,6 +98,8 @@ set(action_files
rosidl_generate_interfaces(${PROJECT_NAME}
${msg_files}
${srv_files}
# TODO(mlautman) uncomment once IDL refactor fixes action issue
# ${action_files}
DEPENDENCIES
action_msgs
builtin_interfaces
Expand All @@ -110,4 +112,6 @@ rosidl_generate_interfaces(${PROJECT_NAME}
trajectory_msgs
)

ament_export_dependencies(rosidl_default_runtime)

ament_package()
33 changes: 13 additions & 20 deletions package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -16,27 +16,20 @@
<url type="bugtracker">https://github.com/ros-planning/moveit_msgs/issues</url>
<url type="repository">https://github.com/ros-planning/moveit_msgs</url>

<build_depend>message_generation</build_depend>
<buildtool_depend>ament_cmake</buildtool_depend>

<build_depend>rosidl_default_generators</build_depend>
<build_depend>octomap_msgs</build_depend>
<build_depend>action_msgs</build_depend>
<build_depend>sensor_msgs</build_depend>
<build_depend>geometry_msgs</build_depend>
<build_depend>trajectory_msgs</build_depend>
<build_depend>shape_msgs</build_depend>
<build_depend>object_recognition_msgs</build_depend>
<build_depend>std_msgs</build_depend>

<exec_depend>message_generation</exec_depend> <!-- provide message generation to downstream packages -->
<exec_depend>message_runtime</exec_depend>
<exec_depend>octomap_msgs</exec_depend>
<exec_depend>action_msgs</exec_depend>
<exec_depend>sensor_msgs</exec_depend>
<exec_depend>geometry_msgs</exec_depend>
<exec_depend>trajectory_msgs</exec_depend>
<exec_depend>shape_msgs</exec_depend>
<exec_depend>object_recognition_msgs</exec_depend>
<exec_depend>std_msgs</exec_depend>

<depend>octomap_msgs</depend>
<depend>action_msgs</depend>
<depend>sensor_msgs</depend>
<depend>geometry_msgs</depend>
<depend>trajectory_msgs</depend>
<depend>shape_msgs</depend>
<depend>object_recognition_msgs</depend>
<depend>std_msgs</depend>

<exec_depend>rosidl_default_runtime</exec_depend>

<member_of_group>rosidl_interface_packages</member_of_group>

Expand Down

0 comments on commit 63e5481

Please sign in to comment.