Skip to content

Commit 35e6307

Browse files
committed
add ros-jazzy-moveit-ros-perception osx patch
1 parent bfd43e5 commit 35e6307

File tree

1 file changed

+14
-0
lines changed

1 file changed

+14
-0
lines changed
Lines changed: 14 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -0,0 +1,14 @@
1+
diff --git a/semantic_world/CMakeLists.txt b/semantic_world/CMakeLists.txt
2+
index dc8d941da..61f34d777 100644
3+
--- a/semantic_world/CMakeLists.txt
4+
+++ b/semantic_world/CMakeLists.txt
5+
@@ -13,6 +13,8 @@ ament_target_dependencies(
6+
moveit_msgs
7+
tf2_eigen
8+
Eigen3
9+
- Boost)
10+
+ Boost
11+
+ OpenCV
12+
+)
13+
14+
install(DIRECTORY include/ DESTINATION include/moveit_ros_perception)

0 commit comments

Comments
 (0)