diff --git a/Makefile b/Makefile
deleted file mode 100644
index b75b928f20ef9ea4f509a17db62e4e31b422c27f..0000000000000000000000000000000000000000
--- a/Makefile
+++ /dev/null
@@ -1 +0,0 @@
-include $(shell rospack find mk)/cmake.mk
\ No newline at end of file
diff --git a/cfg/safe_cmd_alg_config.cfg b/cfg/safe_cmd_alg_config.cfg
deleted file mode 100755
index 0857f1062ee0620abaa6ecd5e43f0dbe901fb876..0000000000000000000000000000000000000000
--- a/cfg/safe_cmd_alg_config.cfg
+++ /dev/null
@@ -1,45 +0,0 @@
-#! /usr/bin/env python
-#*  All rights reserved.
-#*
-#*  Redistribution and use in source and binary forms, with or without
-#*  modification, are permitted provided that the following conditions
-#*  are met:
-#*
-#*   * Redistributions of source code must retain the above copyright
-#*     notice, this list of conditions and the following disclaimer.
-#*   * Redistributions in binary form must reproduce the above
-#*     copyright notice, this list of conditions and the following
-#*     disclaimer in the documentation and/or other materials provided
-#*     with the distribution.
-#*   * Neither the name of the Willow Garage nor the names of its
-#*     contributors may be used to endorse or promote products derived
-#*     from this software without specific prior written permission.
-#*
-#*  THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
-#*  "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
-#*  LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
-#*  FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
-#*  COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
-#*  INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
-#*  BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
-#*  LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
-#*  CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
-#*  LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
-#*  ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
-#*  POSSIBILITY OF SUCH DAMAGE.
-#***********************************************************
-
-# Author: 
-
-PACKAGE='iri_safe_cmd'
-import roslib; roslib.load_manifest(PACKAGE)
-
-from dynamic_reconfigure.parameter_generator import *
-
-gen = ParameterGenerator()
-
-#       Name                       Type       Reconfiguration level            Description                       Default   Min   Max
-gen.add("unsafe", bool_t,  0, "Not use the safe module", False)
-#gen.add("velocity_scale_factor",  double_t,  0,                               "Maximum velocity scale factor",  0.5,      0.0,  1.0)
-
-exit(gen.generate(PACKAGE, "SafeCmdAlgorithm", "SafeCmd"))
diff --git a/launch/test_bag.launch b/launch/test_bag.launch
deleted file mode 100644
index 1a3fd21d606c2fc6f7f979c3a74ab81df0dc31d9..0000000000000000000000000000000000000000
--- a/launch/test_bag.launch
+++ /dev/null
@@ -1,23 +0,0 @@
-<!-- This is a test for iri_robot_pose_ekf using a bag recorded with TEO robot-->
-<launch>
-
-  <arg name="bag" default="default.bag"/>
-  <param name="/use_sim_time" value="True"/>
-
-  <node pkg="rosbag" type="play" name="rosbag"  output="screen" args = "$(find bags)/$(arg bag) --pause --clock">
-  </node>
-
-
-  <node pkg="iri_safe_cmd"
-        type="iri_safe_cmd"
-        name="iri_safe_cmd"
-        output="screen"
-        >
-        <remap from="~cmd_vel"     to="/teo/segway/cmd_vel"/>
-        <remap from="~rear_laser"  to="/teo/sensors/rear_laser"/>
-        <remap from="~front_laser" to="/teo/sensors/front_laser"/>
-  </node>
-
-  
-</launch>
-
diff --git a/manifest.xml b/manifest.xml
deleted file mode 100644
index 601c54fe6274c4c26ead2b09b7d545dbea979790..0000000000000000000000000000000000000000
--- a/manifest.xml
+++ /dev/null
@@ -1,20 +0,0 @@
-<package>
-  <description brief="iri_safe_cmd">
-
-     This node takes the cmd_vel input and depending on front and/or rear LaserScan lectures
-     and the command, stops the platform or lets it go
-
-
-  </description>
-  <author>Maintained by IRI Robotics Lab, Marti Morta</author>
-  <license>LGPL</license>
-  <review status="unreviewed" notes=""/>
-  <url>http://ros.org/wiki/iri_safe_cmd</url>
-  <depend package="roscpp"/>
-  <depend package="iri_base_algorithm"/>
-  <depend package="geometry_msgs"/>
-  <depend package="sensor_msgs"/>
-
-</package>
-
-