Skip to content

Commit

Permalink
Merge pull request #1 from ooeygui/master
Browse files Browse the repository at this point in the history
MoveIt fixes
  • Loading branch information
lilustga authored Jul 21, 2020
2 parents 8b0f364 + 4a1887b commit 33156ef
Show file tree
Hide file tree
Showing 4 changed files with 10 additions and 7 deletions.
2 changes: 1 addition & 1 deletion moveit_core/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -11,7 +11,7 @@ if(NOT CMAKE_CXX_COMPILER_ID STREQUAL "MSVC")
-Wwrite-strings -Wunreachable-code -Wpointer-arith -Wredundant-decls -Wcast-qual
-Wno-unused-parameter -Wno-unused-function)
else()
add_compile_options(/W3)
add_compile_options(/W3 /wd4251 /wd4068 /wd4275)
endif()

if(CMAKE_CXX_COMPILER_ID STREQUAL "GNU")
Expand Down
2 changes: 1 addition & 1 deletion moveit_core/robot_state/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -47,7 +47,7 @@ if(BUILD_TESTING)
include_directories(${moveit_resources_INCLUDE_DIRS})

if(WIN32)
# TODO add windows paths
add_compile_definitions(_USE_MATH_DEFINES /wd4251 /wd4068 /wd4275)
else()
set(append_library_dirs "${CMAKE_CURRENT_BINARY_DIR};${CMAKE_CURRENT_BINARY_DIR}/../utils")
endif()
Expand Down
8 changes: 3 additions & 5 deletions moveit_core/utils/CMakeLists.txt
Original file line number Diff line number Diff line change
@@ -1,14 +1,13 @@
set(MOVEIT_LIB_NAME moveit_utils)

add_library(${MOVEIT_LIB_NAME} SHARED
add_library(${MOVEIT_LIB_NAME}
src/lexical_casts.cpp
src/message_checks.cpp
src/rclcpp_utils.cpp
)

ament_target_dependencies(${MOVEIT_LIB_NAME} Boost moveit_msgs)
set_target_properties(${MOVEIT_LIB_NAME} PROPERTIES VERSION "${${PROJECT_NAME}_VERSION}")
set_target_properties(${MOVEIT_LIB_NAME} PROPERTIES WINDOWS_EXPORT_ALL_SYMBOLS TRUE)

install(TARGETS ${MOVEIT_LIB_NAME}
LIBRARY DESTINATION lib
Expand All @@ -21,7 +20,7 @@ if(BUILD_TESTING)
find_package(ament_cmake_gtest REQUIRED)
find_package(moveit_resources REQUIRED)
set(MOVEIT_TEST_LIB_NAME moveit_test_utils)
add_library(${MOVEIT_TEST_LIB_NAME} SHARED
add_library(${MOVEIT_TEST_LIB_NAME}
src/robot_model_test_utils.cpp)
ament_target_dependencies(${MOVEIT_TEST_LIB_NAME}
Boost
Expand All @@ -34,8 +33,7 @@ if(BUILD_TESTING)
)

set_target_properties(${MOVEIT_TEST_LIB_NAME} PROPERTIES VERSION "${${PROJECT_NAME}_VERSION}")
set_target_properties(${MOVEIT_TEST_LIB_NAME} PROPERTIES WINDOWS_EXPORT_ALL_SYMBOLS TRUE)


ament_export_libraries(${MOVEIT_TEST_LIB_NAME} ${MOVEIT_LIB_NAME})
ament_export_include_directories(include)

Expand Down
5 changes: 5 additions & 0 deletions moveit_demo_nodes/run_moveit_cpp/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -10,6 +10,11 @@ if(CMAKE_COMPILER_IS_GNUCXX OR CMAKE_CXX_COMPILER_ID MATCHES "Clang")
add_compile_options(-Wall -Wextra -Wpedantic)
endif()

if (WIN32)
add_compile_options(/wd4251 /wd4068 /wd4275)
endif()


# find dependencies
find_package(ament_cmake REQUIRED)
find_package(moveit_ros_planning_interface REQUIRED)
Expand Down

0 comments on commit 33156ef

Please sign in to comment.