Skip to content
Open
Show file tree
Hide file tree
Changes from 2 commits
Commits
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
3 changes: 3 additions & 0 deletions patch/dependencies.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -264,3 +264,6 @@ wasm_cpp:
aws_sdk_cpp_vendor:
add_host: ["aws-sdk-cpp"]
add_run: ["aws-sdk-cpp"]
polygon_rviz_plugins:
add_host: ["libgl-devel"]
add_run: ["libgl-devel"]
14 changes: 14 additions & 0 deletions patch/ros-humble-color-util.patch
Original file line number Diff line number Diff line change
@@ -0,0 +1,14 @@
diff --git a/CMakeLists.txt b/CMakeLists.txt
index bc98189..71ce465 100644
--- a/CMakeLists.txt
+++ b/CMakeLists.txt
@@ -19,6 +19,9 @@ find_package(ament_cmake REQUIRED)
find_package(std_msgs REQUIRED)

add_library(color_util src/convert.cpp)
+if(WIN32 AND MSVC)
+ set_target_properties(color_util PROPERTIES WINDOWS_EXPORT_ALL_SYMBOLS ON)
+endif()
target_include_directories(color_util PUBLIC
$<BUILD_INTERFACE:${CMAKE_CURRENT_SOURCE_DIR}/include>
$<INSTALL_INTERFACE:include>
14 changes: 14 additions & 0 deletions patch/ros-humble-polygon-utils.patch
Original file line number Diff line number Diff line change
@@ -0,0 +1,14 @@
diff --git a/CMakeLists.txt b/CMakeLists.txt
index bc98189..71ce465 100644
--- a/CMakeLists.txt
+++ b/CMakeLists.txt
@@ -19,6 +19,9 @@ find_package(geometry_msgs REQUIRED)
find_package(polygon_msgs REQUIRED)

add_library(polygon_utils src/polygon_utils.cpp)
+if(WIN32 AND MSVC)
+ set_target_properties(polygon_utils PROPERTIES WINDOWS_EXPORT_ALL_SYMBOLS ON)
+endif()
target_include_directories(polygon_utils PUBLIC
$<BUILD_INTERFACE:${CMAKE_CURRENT_SOURCE_DIR}/include>
$<INSTALL_INTERFACE:include>
10 changes: 10 additions & 0 deletions vinca.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -315,6 +315,16 @@ packages_select_by_deps:
- imu_tools
- rplidar_ros
- vector_pursuit_controller
- imu_transformer
- imu_calib
- polygon_msgs
- polygon_utils
- color_util
- rclc_parameter
- ros_humble_rclc_lifecycle
- ros_humble_rclc_examples
- ptz_action_server_msgs
- py_trees

# These packages are only built on Linux as they depend on Linux-specific API
- if: linux
Expand Down
Loading