Skip to content

Commit b441680

Browse files
committed
added package dependencies
1 parent dbeed94 commit b441680

File tree

2 files changed

+17
-4
lines changed

2 files changed

+17
-4
lines changed

‎src/lidar/CMakeLists.txt‎

Lines changed: 10 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -7,7 +7,11 @@ project(lidar)
77
## Find catkin macros and libraries
88
## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz)
99
## is used, also find other catkin packages
10-
find_package(catkin REQUIRED)
10+
find_package(catkin REQUIRED COMPONENTS
11+
roscpp
12+
rospy
13+
std_msgs
14+
)
1115

1216
## System dependencies are found with CMake's conventions
1317
# find_package(Boost REQUIRED COMPONENTS system)
@@ -66,7 +70,7 @@ find_package(catkin REQUIRED)
6670
## Generate added messages and services with any dependencies listed here
6771
# generate_messages(
6872
# DEPENDENCIES
69-
# std_msgs # Or other packages containing msgs
73+
# std_msgs
7074
# )
7175

7276
################################################
@@ -101,7 +105,7 @@ find_package(catkin REQUIRED)
101105
catkin_package(
102106
# INCLUDE_DIRS include
103107
# LIBRARIES lidar
104-
# CATKIN_DEPENDS other_catkin_pkg
108+
# CATKIN_DEPENDS roscpp rospy std_msgs
105109
# DEPENDS system_lib
106110
)
107111

@@ -112,6 +116,9 @@ catkin_package(
112116
## Specify additional locations of header files
113117
## Your package locations should be listed before other locations
114118
# include_directories(include)
119+
include_directories(
120+
${catkin_INCLUDE_DIRS}
121+
)
115122

116123
## Declare a C++ library
117124
# add_library(${PROJECT_NAME}

‎src/lidar/package.xml‎

Lines changed: 7 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -4,7 +4,7 @@
44
<version>0.0.0</version>
55
<description>The lidar package</description>
66

7-
<!-- One maintainer tag required, multiple allowed, one person per tag -->
7+
<!-- One maintainer tag required, multiple allowed, one person per tag -->
88
<!-- Example: -->
99
<!-- <maintainer email="jane.doe@example.com">Jane Doe</maintainer> -->
1010
<maintainer email="mac@nevada.unr.edu">mac</maintainer>
@@ -40,6 +40,12 @@
4040
<!-- Use test_depend for packages you need only for testing: -->
4141
<!-- <test_depend>gtest</test_depend> -->
4242
<buildtool_depend>catkin</buildtool_depend>
43+
<build_depend>roscpp</build_depend>
44+
<build_depend>rospy</build_depend>
45+
<build_depend>std_msgs</build_depend>
46+
<run_depend>roscpp</run_depend>
47+
<run_depend>rospy</run_depend>
48+
<run_depend>std_msgs</run_depend>
4349

4450

4551
<!-- The export tag contains other, unspecified, tags -->

0 commit comments

Comments
 (0)