From 800db7df2351c8c4aca33b72907c81a8fa281d62 Mon Sep 17 00:00:00 2001
From: Irene Garcia Camacho <igarcia@iri.upc.edu>
Date: Fri, 3 Aug 2018 13:59:14 +0200
Subject: [PATCH] Changed name of file from MoveBaseModule.cfg to
 MovePlatformModule.cfg

---
 cfg/MoveBaseModule.cfg | 48 ------------------------------------------
 1 file changed, 48 deletions(-)
 delete mode 100755 cfg/MoveBaseModule.cfg

diff --git a/cfg/MoveBaseModule.cfg b/cfg/MoveBaseModule.cfg
deleted file mode 100755
index 715aa25..0000000
--- a/cfg/MoveBaseModule.cfg
+++ /dev/null
@@ -1,48 +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='move_platform_module'
-
-from dynamic_reconfigure.parameter_generator_catkin import *
-
-gen = ParameterGenerator()
-
-#       Name                       Type       Reconfiguration level            Description                         Default   Min     Max
-#gen.add("velocity_scale_factor",  double_t,  0,                               "Maximum velocity scale factor",    0.5,      0.0,    1.0)
-gen.add("rate_hz",                 double_t,  0,                               "Move platform module rate in Hz",      1.0,      1.0,    100.0)
-gen.add("cmd_vel_rate_hz",         double_t,  0,                               "Cmd vel publish rate in Hz",       10.0,     1.0,    100.0)
-gen.add("distance_tol",            double_t,  0,                               "Tolerancec for the distance",      0.05,     0.001,  0.5)
-gen.add("velocity",                double_t,  0,                               "Velocity",                         0.2,      0.1,    0.8)
-
-
-exit(gen.generate(PACKAGE, "MovePlatformModuleAlgorithm", "MovePlatformModule"))
-- 
GitLab