Skip to content
Snippets Groups Projects
Select Git revision
  • d71875b2538f3bcb2475b9b92c1cb87fddbe9c19
  • master default protected
2 results

entrypoint.sh

Blame
  • Forked from CeTI / ROS / panda_gazebo_workspace
    Source project has a limited visibility.
    CMakeLists.txt 14.08 KiB
    cmake_minimum_required(VERSION 3.0.2)
    project(ccf)
    
    ## compile as C++14
    set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} -std=c++17")
    set(GCC_COVERAGE_COMPILE_FLAGS "-fpermissive")
    
    ## Find catkin macros and libraries
    ## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz)
    ## is used, also find other catkin packages
    find_package(catkin REQUIRED COMPONENTS
            roscpp
            std_msgs
            geometry_msgs
            moveit_core
            moveit_ros_planning_interface
            message_generation
            panda_grasping
            )
    
    ## System dependencies are found with CMake's conventions
    # find_package(Boost REQUIRED COMPONENTS system)
    
    find_package(Protobuf 3 REQUIRED)
    
    include_directories(${CMAKE_CURRENT_BINARY_DIR})
    
    
    # make sure NNG is updated in the submodule
    execute_process(COMMAND git submodule update --init -- lib/nng
            WORKING_DIRECTORY ${CMAKE_CURRENT_SOURCE_DIR})
    add_subdirectory(lib/nng)
    
    ## Uncomment this if the package has a setup.py. This macro ensures
    ## modules and global scripts declared therein get installed
    ## See http://ros.org/doc/api/catkin/html/user_guide/setup_dot_py.html
    # catkin_python_setup()
    
    ################################################
    ## Declare ROS messages, services and actions ##
    ################################################
    
    ## To declare and build messages, services or actions from within this
    ## package, follow these steps:
    ## * Let MSG_DEP_SET be the set of packages whose message types you use in
    ##   your messages/services/actions (e.g. std_msgs, actionlib_msgs, ...).
    ## * In the file package.xml:
    ##   * add a build_depend tag for "message_generation"
    ##   * add a build_depend and a exec_depend tag for each package in MSG_DEP_SET
    ##   * If MSG_DEP_SET isn't empty the following dependency has been pulled in
    ##     but can be declared for certainty nonetheless:
    ##     * add a exec_depend tag for "message_runtime"
    ## * In this file (CMakeLists.txt):
    ##   * add "message_generation" and every package in MSG_DEP_SET to
    ##     find_package(catkin REQUIRED COMPONENTS ...)
    ##   * add "message_runtime" and every package in MSG_DEP_SET to
    ##     catkin_package(CATKIN_DEPENDS ...)
    ##   * uncomment the add_*_files sections below as needed
    ##     and list every .msg/.srv/.action file to be processed
    ##   * uncomment the generate_messages entry below
    ##   * add every package in MSG_DEP_SET to generate_messages(DEPENDENCIES ...)
    
    ## Generate messages in the 'msg' folder
    add_message_files(
            FILES
            PickPlace.msg
            PickDrop.msg
    )
    
    ## Generate services in the 'srv' folder