diff --git a/rclcpp_lifecycle/CMakeLists.txt b/rclcpp_lifecycle/CMakeLists.txt index e844eaedc1..10bc512848 100644 --- a/rclcpp_lifecycle/CMakeLists.txt +++ b/rclcpp_lifecycle/CMakeLists.txt @@ -14,7 +14,6 @@ find_package(ament_cmake_ros REQUIRED) find_package(rclcpp REQUIRED) find_package(rcl_lifecycle REQUIRED) find_package(rosidl_typesupport_cpp REQUIRED) -find_package(std_msgs REQUIRED) find_package(lifecycle_msgs REQUIRED) include_directories(include) diff --git a/rclcpp_lifecycle/package.xml b/rclcpp_lifecycle/package.xml index baf4fd3a6d..518373fb87 100644 --- a/rclcpp_lifecycle/package.xml +++ b/rclcpp_lifecycle/package.xml @@ -14,7 +14,6 @@ rcl_lifecycle rmw_implementation rosidl_typesupport_cpp - std_msgs lifecycle_msgs rclcpp @@ -22,7 +21,6 @@ rclpy rmw_implementation rosidl_typesupport_cpp - std_msgs ament_cmake_gtest ament_lint_auto