moveit_task_constructor/msgs/CMakeLists.txt
Robert Haschke 2da9e0d722 rework solution msgs
- to allow solution wrappers (WrappedSolution, SolutionSequence)
  to transmit their comment and markers as well
- introduced new SolutionInfo.msg,
  which is the info common to solution wrappers and actual SubTrajectories
2019-02-12 13:57:12 +01:00

39 lines
684 B
CMake

cmake_minimum_required(VERSION 2.8.12)
project(moveit_task_constructor_msgs)
set(MSG_DEPS moveit_msgs visualization_msgs)
find_package(catkin REQUIRED COMPONENTS
message_generation
${MSG_DEPS}
)
# ROS messages, services and actions
add_message_files(DIRECTORY msg FILES
Property.msg
Solution.msg
SolutionInfo.msg
StageDescription.msg
StageStatistics.msg
SubSolution.msg
SubTrajectory.msg
TaskDescription.msg
TaskStatistics.msg
)
add_service_files(DIRECTORY srv FILES
GetSolution.srv
)
add_action_files(DIRECTORY action FILES
ExecuteTaskSolution.action
)
generate_messages(DEPENDENCIES ${MSG_DEPS})
catkin_package(
CATKIN_DEPENDS
message_runtime
${MSG_DEPS}
)