|
|
@ -11,6 +11,7 @@ find_package(catkin REQUIRED COMPONENTS
|
|
|
|
roscpp
|
|
|
|
roscpp
|
|
|
|
rospy
|
|
|
|
rospy
|
|
|
|
std_msgs
|
|
|
|
std_msgs
|
|
|
|
|
|
|
|
message_generation
|
|
|
|
)
|
|
|
|
)
|
|
|
|
|
|
|
|
|
|
|
|
## System dependencies are found with CMake's conventions
|
|
|
|
## System dependencies are found with CMake's conventions
|
|
|
@ -47,18 +48,17 @@ find_package(catkin REQUIRED COMPONENTS
|
|
|
|
## * add every package in MSG_DEP_SET to generate_messages(DEPENDENCIES ...)
|
|
|
|
## * add every package in MSG_DEP_SET to generate_messages(DEPENDENCIES ...)
|
|
|
|
|
|
|
|
|
|
|
|
## Generate messages in the 'msg' folder
|
|
|
|
## Generate messages in the 'msg' folder
|
|
|
|
# add_message_files(
|
|
|
|
add_message_files(
|
|
|
|
# FILES
|
|
|
|
FILES
|
|
|
|
# Message1.msg
|
|
|
|
Neopixel.msg
|
|
|
|
# Message2.msg
|
|
|
|
Neopixels.msg
|
|
|
|
# )
|
|
|
|
)
|
|
|
|
|
|
|
|
|
|
|
|
## Generate services in the 'srv' folder
|
|
|
|
## Generate services in the 'srv' folder
|
|
|
|
# add_service_files(
|
|
|
|
add_service_files(
|
|
|
|
# FILES
|
|
|
|
FILES
|
|
|
|
# Service1.srv
|
|
|
|
FillNeopixels.srv
|
|
|
|
# Service2.srv
|
|
|
|
)
|
|
|
|
# )
|
|
|
|
|
|
|
|
|
|
|
|
|
|
|
|
## Generate actions in the 'action' folder
|
|
|
|
## Generate actions in the 'action' folder
|
|
|
|
# add_action_files(
|
|
|
|
# add_action_files(
|
|
|
@ -68,10 +68,10 @@ find_package(catkin REQUIRED COMPONENTS
|
|
|
|
# )
|
|
|
|
# )
|
|
|
|
|
|
|
|
|
|
|
|
## Generate added messages and services with any dependencies listed here
|
|
|
|
## Generate added messages and services with any dependencies listed here
|
|
|
|
# generate_messages(
|
|
|
|
generate_messages(
|
|
|
|
# DEPENDENCIES
|
|
|
|
DEPENDENCIES
|
|
|
|
# std_msgs # Or other packages containing msgs
|
|
|
|
std_msgs # Or other packages containing msgs
|
|
|
|
# )
|
|
|
|
)
|
|
|
|
|
|
|
|
|
|
|
|
################################################
|
|
|
|
################################################
|
|
|
|
## Declare ROS dynamic reconfigure parameters ##
|
|
|
|
## Declare ROS dynamic reconfigure parameters ##
|
|
|
@ -107,6 +107,7 @@ catkin_package(
|
|
|
|
# LIBRARIES simple_example
|
|
|
|
# LIBRARIES simple_example
|
|
|
|
# CATKIN_DEPENDS roscpp rospy stdmsgs
|
|
|
|
# CATKIN_DEPENDS roscpp rospy stdmsgs
|
|
|
|
# DEPENDS system_lib
|
|
|
|
# DEPENDS system_lib
|
|
|
|
|
|
|
|
CATKIN_DEPENDS message_runtime
|
|
|
|
)
|
|
|
|
)
|
|
|
|
|
|
|
|
|
|
|
|
###########
|
|
|
|
###########
|
|
|
|