mia_hand_description  rel 1.0.0
mia_hand_description/CMakeLists.txt File Reference

Functions

 cmake_minimum_required (VERSION 3.0.2) project(mia_hand_description) find_package(catkin REQUIRED COMPONENTS roscpp urdf std_msgs genmsg sensor_msgs) catkin_package(CATKIN_DEPENDS roscpp urdf INCLUDE_DIRS include LIBRARIES $
 
 include_directories (include ${catkin_INCLUDE_DIRS}) add_library($
 
src mia_thumb_opp_passivejoints cpp add_executable (remap_mia_joint_states src/remap_mia_joint_states.cpp src/mia_thumb_opp_passivejoints.cpp) target_link_libraries($
 

Function Documentation

◆ add_executable()

src mia_thumb_opp_passivejoints cpp add_executable ( remap_mia_joint_states src/remap_mia_joint_states.cpp src/mia_thumb_opp_passivejoints.  cpp)

Definition at line 36 of file CMakeLists.txt.

◆ cmake_minimum_required()

cmake_minimum_required ( VERSION 3.0.  2)

Definition at line 1 of file CMakeLists.txt.

◆ include_directories()

include_directories ( include ${catkin_INCLUDE_DIRS}  )

Definition at line 30 of file CMakeLists.txt.