diff --git a/CMakeLists.txt b/CMakeLists.txt
index a389b91bd48ce7c90ef3a21c78a0829674117b2d..dd94b41a7dfcc5cb5c88e1b1499fc77ddf5db588 100644
--- a/CMakeLists.txt
+++ b/CMakeLists.txt
@@ -107,7 +107,7 @@ generate_dynamic_reconfigure_options(
 ## DEPENDS: system dependencies of this project that dependent projects also need
 catkin_package(
  INCLUDE_DIRS include
- LIBRARIES gripper_module play_motion_module head_module torso_module nav_module tts_module#leds_module
+ LIBRARIES gripper_module play_motion_module head_module torso_module nav_module tts_module arm_module#leds_module 
  CATKIN_DEPENDS roscpp dynamic_reconfigure iri_ros_tools actionlib play_motion_msgs control_msgs geometry_msgs std_srvs move_base_msgs tf nav_msgs pal_navigation_msgs pal_waypoint_msgs pal_interaction_msgs moveit_msgs
 #  DEPENDS system_lib
 )