Skip to content

Commit

Permalink
Remove imu_listener node (#272)
Browse files Browse the repository at this point in the history
* remove unused rmw_implementation dependency

* remove imu listener

* rclcpp is already a build and exec depend

* add missing rmw dependency
  • Loading branch information
mikaelarguedas committed Aug 2, 2018
1 parent 12ef351 commit 842f29a
Show file tree
Hide file tree
Showing 3 changed files with 2 additions and 60 deletions.
4 changes: 0 additions & 4 deletions demo_nodes_cpp/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -16,7 +16,6 @@ find_package(example_interfaces REQUIRED)
find_package(rclcpp REQUIRED)
find_package(rcutils)
find_package(rmw REQUIRED)
find_package(sensor_msgs REQUIRED)
find_package(std_msgs REQUIRED)

function(custom_executable subfolder target)
Expand All @@ -34,9 +33,6 @@ endfunction()
custom_executable(topics talker)
custom_executable(topics listener)
custom_executable(topics listener_best_effort)
custom_executable(topics imu_listener)
ament_target_dependencies(imu_listener
"sensor_msgs")
custom_executable(topics allocator_tutorial)
custom_executable(topics talker_serialized_message)
custom_executable(topics listener_serialized_message)
Expand Down
7 changes: 2 additions & 5 deletions demo_nodes_cpp/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -14,25 +14,22 @@
<build_depend>example_interfaces</build_depend>
<build_depend>rclcpp</build_depend>
<build_depend>rcutils</build_depend>
<build_depend>rmw</build_depend>
<build_depend>rmw_implementation_cmake</build_depend>
<build_depend>sensor_msgs</build_depend>
<build_depend>std_msgs</build_depend>

<exec_depend>example_interfaces</exec_depend>
<exec_depend>launch_ros</exec_depend>
<exec_depend>rclcpp</exec_depend>
<exec_depend>rcutils</exec_depend>
<exec_depend>rmw_implementation</exec_depend>
<exec_depend>sensor_msgs</exec_depend>
<exec_depend>rmw</exec_depend>
<exec_depend>std_msgs</exec_depend>

<test_depend>ament_cmake_pytest</test_depend>
<test_depend>ament_lint_auto</test_depend>
<test_depend>ament_lint_common</test_depend>
<test_depend>launch</test_depend>
<test_depend>launch_testing</test_depend>
<test_depend>rclcpp</test_depend>
<test_depend>rmw_implementation</test_depend>

<export>
<build_type>ament_cmake</build_type>
Expand Down
51 changes: 0 additions & 51 deletions demo_nodes_cpp/src/topics/imu_listener.cpp

This file was deleted.

0 comments on commit 842f29a

Please sign in to comment.