diff --git a/CMakeLists.txt b/CMakeLists.txt
new file mode 100644
index 0000000000000000000000000000000000000000..dcbf8a7b6e2befb419c91d383f14dccb2f17df08
--- /dev/null
+++ b/CMakeLists.txt
@@ -0,0 +1,202 @@
+cmake_minimum_required(VERSION 2.8.3)
+project(iri_dabo_how_to)
+
+## Compile as C++11, supported in ROS Kinetic and newer
+# add_compile_options(-std=c++11)
+
+## Find catkin macros and libraries
+## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz)
+## is used, also find other catkin packages
+find_package(catkin REQUIRED)
+
+## System dependencies are found with CMake's conventions
+# find_package(Boost REQUIRED COMPONENTS system)
+
+
+## Uncomment this if the package has a setup.py. This macro ensures
+## modules and global scripts declared therein get installed
+## See http://ros.org/doc/api/catkin/html/user_guide/setup_dot_py.html
+# catkin_python_setup()
+
+################################################
+## Declare ROS messages, services and actions ##
+################################################
+
+## To declare and build messages, services or actions from within this
+## package, follow these steps:
+## * Let MSG_DEP_SET be the set of packages whose message types you use in
+##   your messages/services/actions (e.g. std_msgs, actionlib_msgs, ...).
+## * In the file package.xml:
+##   * add a build_depend tag for "message_generation"
+##   * add a build_depend and a exec_depend tag for each package in MSG_DEP_SET
+##   * If MSG_DEP_SET isn't empty the following dependency has been pulled in
+##     but can be declared for certainty nonetheless:
+##     * add a exec_depend tag for "message_runtime"
+## * In this file (CMakeLists.txt):
+##   * add "message_generation" and every package in MSG_DEP_SET to
+##     find_package(catkin REQUIRED COMPONENTS ...)
+##   * add "message_runtime" and every package in MSG_DEP_SET to
+##     catkin_package(CATKIN_DEPENDS ...)
+##   * uncomment the add_*_files sections below as needed
+##     and list every .msg/.srv/.action file to be processed
+##   * uncomment the generate_messages entry below
+##   * add every package in MSG_DEP_SET to generate_messages(DEPENDENCIES ...)
+
+## Generate messages in the 'msg' folder
+# add_message_files(
+#   FILES
+#   Message1.msg
+#   Message2.msg
+# )
+
+## Generate services in the 'srv' folder
+# add_service_files(
+#   FILES
+#   Service1.srv
+#   Service2.srv
+# )
+
+## Generate actions in the 'action' folder
+# add_action_files(
+#   FILES
+#   Action1.action
+#   Action2.action
+# )
+
+## Generate added messages and services with any dependencies listed here
+# generate_messages(
+#   DEPENDENCIES
+#   std_msgs  # Or other packages containing msgs
+# )
+
+################################################
+## Declare ROS dynamic reconfigure parameters ##
+################################################
+
+## To declare and build dynamic reconfigure parameters within this
+## package, follow these steps:
+## * In the file package.xml:
+##   * add a build_depend and a exec_depend tag for "dynamic_reconfigure"
+## * In this file (CMakeLists.txt):
+##   * add "dynamic_reconfigure" to
+##     find_package(catkin REQUIRED COMPONENTS ...)
+##   * uncomment the "generate_dynamic_reconfigure_options" section below
+##     and list every .cfg file to be processed
+
+## Generate dynamic reconfigure parameters in the 'cfg' folder
+# generate_dynamic_reconfigure_options(
+#   cfg/DynReconf1.cfg
+#   cfg/DynReconf2.cfg
+# )
+
+###################################
+## catkin specific configuration ##
+###################################
+## The catkin_package macro generates cmake config files for your package
+## Declare things to be passed to dependent projects
+## INCLUDE_DIRS: uncomment this if your package contains header files
+## LIBRARIES: libraries you create in this project that dependent projects also need
+## CATKIN_DEPENDS: catkin_packages dependent projects also need
+## DEPENDS: system dependencies of this project that dependent projects also need
+catkin_package(
+#  INCLUDE_DIRS include
+#  LIBRARIES iri_dabo_how_to
+#  CATKIN_DEPENDS other_catkin_pkg
+#  DEPENDS system_lib
+)
+
+###########
+## Build ##
+###########
+
+## Specify additional locations of header files
+## Your package locations should be listed before other locations
+include_directories(
+# include
+# ${catkin_INCLUDE_DIRS}
+)
+
+## Declare a C++ library
+# add_library(${PROJECT_NAME}
+#   src/${PROJECT_NAME}/iri_dabo_how_to.cpp
+# )
+
+## Add cmake target dependencies of the library
+## as an example, code may need to be generated before libraries
+## either from message generation or dynamic reconfigure
+# add_dependencies(${PROJECT_NAME} ${${PROJECT_NAME}_EXPORTED_TARGETS} ${catkin_EXPORTED_TARGETS})
+
+## Declare a C++ executable
+## With catkin_make all packages are built within a single CMake context
+## The recommended prefix ensures that target names across packages don't collide
+# add_executable(${PROJECT_NAME}_node src/iri_dabo_how_to_node.cpp)
+
+## Rename C++ executable without prefix
+## The above recommended prefix causes long target names, the following renames the
+## target back to the shorter version for ease of user use
+## e.g. "rosrun someones_pkg node" instead of "rosrun someones_pkg someones_pkg_node"
+# set_target_properties(${PROJECT_NAME}_node PROPERTIES OUTPUT_NAME node PREFIX "")
+
+## Add cmake target dependencies of the executable
+## same as for the library above
+# add_dependencies(${PROJECT_NAME}_node ${${PROJECT_NAME}_EXPORTED_TARGETS} ${catkin_EXPORTED_TARGETS})
+
+## Specify libraries to link a library or executable target against
+# target_link_libraries(${PROJECT_NAME}_node
+#   ${catkin_LIBRARIES}
+# )
+
+#############
+## Install ##
+#############
+
+# all install targets should use catkin DESTINATION variables
+# See http://ros.org/doc/api/catkin/html/adv_user_guide/variables.html
+
+## Mark executable scripts (Python etc.) for installation
+## in contrast to setup.py, you can choose the destination
+# install(PROGRAMS
+#   scripts/my_python_script
+#   DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
+# )
+
+## Mark executables for installation
+## See http://docs.ros.org/melodic/api/catkin/html/howto/format1/building_executables.html
+# install(TARGETS ${PROJECT_NAME}_node
+#   RUNTIME DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
+# )
+
+## Mark libraries for installation
+## See http://docs.ros.org/melodic/api/catkin/html/howto/format1/building_libraries.html
+# install(TARGETS ${PROJECT_NAME}
+#   ARCHIVE DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
+#   LIBRARY DESTINATION ${CATKIN_PACKAGE_LIB_DESTINATION}
+#   RUNTIME DESTINATION ${CATKIN_GLOBAL_BIN_DESTINATION}
+# )
+
+## Mark cpp header files for installation
+# install(DIRECTORY include/${PROJECT_NAME}/
+#   DESTINATION ${CATKIN_PACKAGE_INCLUDE_DESTINATION}
+#   FILES_MATCHING PATTERN "*.h"
+#   PATTERN ".svn" EXCLUDE
+# )
+
+## Mark other files for installation (e.g. launch and bag files, etc.)
+# install(FILES
+#   # myfile1
+#   # myfile2
+#   DESTINATION ${CATKIN_PACKAGE_SHARE_DESTINATION}
+# )
+
+#############
+## Testing ##
+#############
+
+## Add gtest based cpp test target and link libraries
+# catkin_add_gtest(${PROJECT_NAME}-test test/test_iri_dabo_how_to.cpp)
+# if(TARGET ${PROJECT_NAME}-test)
+#   target_link_libraries(${PROJECT_NAME}-test ${PROJECT_NAME})
+# endif()
+
+## Add folders to be run by python nosetests
+# catkin_add_nosetests(test)
diff --git a/README.md b/README.md
new file mode 100644
index 0000000000000000000000000000000000000000..503b345e556c6b9b2e4925bec232c40d66c90461
--- /dev/null
+++ b/README.md
@@ -0,0 +1,103 @@
+# iri_dabo_how_to
+
+The Dabo robot, along with his sister Tibi, are mobile, urban, service and social robots, based on a Segway RMP 200 platform, equipped with Hokuyo UTM-30lx lidar and Bumblebee2 stereo camera,  able to move their arms and head with 2 degrees of freedom shoulders and 3 dof neck.
+
+A fully featured gazebo model is also provided to test the robot in simulation. 
+
+# Procedures
+
+Here are the basic precedures to use the robot. Please follow them carefully 
+whenever you need to use the robot.
+
+ * [Startup, operation and shutdown](url-to-pdf-artifact)
+
+ * [Battery management](url-to-pdf-artifact)
+
+# How to use the simulated robot
+
+A Gazebo model for the platform and all its sensors is provided to speed up the testing 
+process. 
+
+To set up the simulator, please follow the next steps:
+
+ * Install the following system dependencies:
+
+```
+sudo apt-get install ros-kinetic-velodyne-description ros-kinetic-velodyne-gazebo-plugins ros-kinetic-hector-gazebo-plugins
+```
+
+ If you want to use a new ROS workspace:
+
+ * Create a new workspace following the steps in this [tutorial](http://wiki.ros.org/catkin/Tutorials/create_a_workspace).
+
+ * Copy the dabo_sim.rosinstall file to the src folder of the new workspace.
+
+ * Initialize the wstool tool on the src folder following the steps in this [tutorial](http://wiki.ros.org/wstool) using 
+  the dabo_sim.rosinstall file available on this repository. From the src folder, execute:
+
+```
+roscd
+cd ../src
+wstool init dabo_sim.rosinstall
+```
+
+ If you want to use an existing ROS workspace:
+
+  * Copy the ana_sim.rosinstall file to the src folder of the existing workspace.
+
+  * Merge the dabo_sim.rosinstall file available on this repository with the existing rosinstall file following the steps 
+   in this [tutorial](http://wiki.ros.org/wstool#Merge_in_Additional_rosinstall_Files). From the src folder, execute:
+
+```
+roscd
+cd ../src
+wstool merge dabo_sim.rosinstall
+```
+
+ * Download the simulator packages by executing the following command from the src folder:
+
+```
+wstool update
+```
+
+ * Compile the newly downloaded packages with the following command:
+
+```
+cd ..
+catkin_make 
+```
+
+Once the setup process is complete, start the simulator with the following command:
+
+```
+roslaunch iri_dabo_gazebo sim_sample.launch
+```
+
+This command should launch the robot with all its sensors in an empty environment with the RVIZ pre-configured to show all 
+sensor data. The name and namespace of all topics, services and actions are exactly the same as in the real robot, although 
+not all of them are available.
+
+A complete list of all ROS interfaces is shown [here]().
+
+# How to use the real robot
+
+
+
+## What to do next
+
+All the tutorials included in this section can be used both in simulation or with the real robot. 
+
+ * [Teleoperation]()
+ 
+ * [Create a navigation 2D map]()
+
+ * [Navigation in a 2D map]()
+
+
+## For developers
+
+<details><summary>click here</summary>
+<p>
+
+</p>
+</details>
\ No newline at end of file
diff --git a/package.xml b/package.xml
new file mode 100644
index 0000000000000000000000000000000000000000..674c61f1e0e7a922a52712a1d90bec4a4a07c5dc
--- /dev/null
+++ b/package.xml
@@ -0,0 +1,59 @@
+<?xml version="1.0"?>
+<package format="2">
+  <name>iri_dabo_how_to</name>
+  <version>0.0.0</version>
+  <description>Documentation on how to set up and use the robot</description>
+
+  <!-- One maintainer tag required, multiple allowed, one person per tag -->
+  <!-- Example:  -->
+  <!-- <maintainer email="jane.doe@example.com">Jane Doe</maintainer> -->
+  <maintainer email="labrobotica@iri.upc.edu">IRI_labrobotica</maintainer>
+
+
+  <!-- One license tag required, multiple allowed, one license per tag -->
+  <!-- Commonly used license strings: -->
+  <!--   BSD, MIT, Boost Software License, GPLv2, GPLv3, LGPLv2.1, LGPLv3 -->
+  <license>LGPL</license>
+
+
+  <!-- Url tags are optional, but multiple are allowed, one per tag -->
+  <!-- Optional attribute type can be: website, bugtracker, or repository -->
+  <!-- Example: -->
+  <!-- <url type="website">http://wiki.ros.org/iri_dabo_how_to</url> -->
+
+
+  <!-- Author tags are optional, multiple are allowed, one per tag -->
+  <!-- Authors do not have to be maintainers, but could be -->
+  <!-- Example: -->
+  <!-- <author email="jane.doe@example.com">Jane Doe</author> -->
+
+
+  <!-- The *depend tags are used to specify dependencies -->
+  <!-- Dependencies can be catkin packages or system dependencies -->
+  <!-- Examples: -->
+  <!-- Use depend as a shortcut for packages that are both build and exec dependencies -->
+  <!--   <depend>roscpp</depend> -->
+  <!--   Note that this is equivalent to the following: -->
+  <!--   <build_depend>roscpp</build_depend> -->
+  <!--   <exec_depend>roscpp</exec_depend> -->
+  <!-- Use build_depend for packages you need at compile time: -->
+  <!--   <build_depend>message_generation</build_depend> -->
+  <!-- Use build_export_depend for packages you need in order to build against this package: -->
+  <!--   <build_export_depend>message_generation</build_export_depend> -->
+  <!-- Use buildtool_depend for build tool packages: -->
+  <!--   <buildtool_depend>catkin</buildtool_depend> -->
+  <!-- Use exec_depend for packages you need at runtime: -->
+  <!--   <exec_depend>message_runtime</exec_depend> -->
+  <!-- Use test_depend for packages you need only for testing: -->
+  <!--   <test_depend>gtest</test_depend> -->
+  <!-- Use doc_depend for packages you need only for building documentation: -->
+  <!--   <doc_depend>doxygen</doc_depend> -->
+  <buildtool_depend>catkin</buildtool_depend>
+
+
+  <!-- The export tag contains other, unspecified, tags -->
+  <export>
+    <!-- Other tools can request additional information be placed here -->
+
+  </export>
+</package>
diff --git a/procedures/startup_operation_shutdown/images/arm-calibration.png b/procedures/startup_operation_shutdown/images/arm-calibration.png
new file mode 100644
index 0000000000000000000000000000000000000000..8f0831572d1e0a11f9aede3224da38e06f1b3213
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/arm-calibration.png differ
diff --git a/procedures/startup_operation_shutdown/images/caster-wheels.png b/procedures/startup_operation_shutdown/images/caster-wheels.png
new file mode 100644
index 0000000000000000000000000000000000000000..9acc8347c642c75e25b9b333ce36d68c13db635e
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/caster-wheels.png differ
diff --git a/procedures/startup_operation_shutdown/images/front-panel.png b/procedures/startup_operation_shutdown/images/front-panel.png
new file mode 100644
index 0000000000000000000000000000000000000000..b657b189fff6cbc58f625f77367ea94fbe1fb612
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/front-panel.png differ
diff --git a/procedures/startup_operation_shutdown/images/power-button.png b/procedures/startup_operation_shutdown/images/power-button.png
new file mode 100644
index 0000000000000000000000000000000000000000..4f146eceb0061d7e4023b456d65035188209cdb0
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/power-button.png differ
diff --git a/procedures/startup_operation_shutdown/images/rear-panel.png b/procedures/startup_operation_shutdown/images/rear-panel.png
new file mode 100644
index 0000000000000000000000000000000000000000..1afc2b6aa7fe4d72fc5dfa28f570b296c962cc72
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/rear-panel.png differ
diff --git a/procedures/startup_operation_shutdown/images/robot-covers.png b/procedures/startup_operation_shutdown/images/robot-covers.png
new file mode 100644
index 0000000000000000000000000000000000000000..33215ba2c0892cc26a4b00d39a6fbb0ecfeff15f
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/robot-covers.png differ
diff --git a/procedures/startup_operation_shutdown/images/robot-elements.png b/procedures/startup_operation_shutdown/images/robot-elements.png
new file mode 100644
index 0000000000000000000000000000000000000000..c27293687052086ba214eb7f07fb54747d1c9785
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/robot-elements.png differ
diff --git a/procedures/startup_operation_shutdown/images/security-system.png b/procedures/startup_operation_shutdown/images/security-system.png
new file mode 100644
index 0000000000000000000000000000000000000000..e77558dd40218f1d00921887b8671bf4c02b6e0d
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/security-system.png differ
diff --git a/procedures/startup_operation_shutdown/images/segway-panel.png b/procedures/startup_operation_shutdown/images/segway-panel.png
new file mode 100644
index 0000000000000000000000000000000000000000..dfbeea915b0e0c6a1d033f100ee311de71cc2133
Binary files /dev/null and b/procedures/startup_operation_shutdown/images/segway-panel.png differ
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.aux b/procedures/startup_operation_shutdown/startup_operation_shutdown.aux
new file mode 100644
index 0000000000000000000000000000000000000000..1913916ad067b5a9ae6d1fba1618ddf531749c08
--- /dev/null
+++ b/procedures/startup_operation_shutdown/startup_operation_shutdown.aux
@@ -0,0 +1,67 @@
+\relax 
+\providecommand\hyper@newdestlabel[2]{}
+\providecommand\HyperFirstAtBeginDocument{\AtBeginDocument}
+\HyperFirstAtBeginDocument{\ifx\hyper@anchor\@undefined
+\global\let\oldcontentsline\contentsline
+\gdef\contentsline#1#2#3#4{\oldcontentsline{#1}{#2}{#3}}
+\global\let\oldnewlabel\newlabel
+\gdef\newlabel#1#2{\newlabelxx{#1}#2}
+\gdef\newlabelxx#1#2#3#4#5#6{\oldnewlabel{#1}{{#2}{#3}}}
+\AtEndDocument{\ifx\hyper@anchor\@undefined
+\let\contentsline\oldcontentsline
+\let\newlabel\oldnewlabel
+\fi}
+\fi}
+\global\let\hyper@last\relax 
+\gdef\HyperFirstAtBeginDocument#1{#1}
+\providecommand\HyField@AuxAddToFields[1]{}
+\providecommand\HyField@AuxAddToCoFields[2]{}
+\select@language{english}
+\@writefile{toc}{\select@language{english}}
+\@writefile{lof}{\select@language{english}}
+\@writefile{lot}{\select@language{english}}
+\citation{tibidabo}
+\citation{safety-sheets}
+\@writefile{toc}{\contentsline {section}{\numberline {1}Description}{2}{section.1}}
+\@writefile{toc}{\contentsline {section}{\numberline {2}Preliminary considerations}{2}{section.2}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {2.1}Safety}{2}{subsection.2.1}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {2.2}Robot description}{2}{subsection.2.2}}
+\citation{battery-procedure}
+\@writefile{lof}{\contentsline {figure}{\numberline {1}{\ignorespaces Robot elements\relax }}{3}{figure.caption.3}}
+\providecommand*\caption@xref[2]{\@setref\relax\@undefined{#1}}
+\newlabel{fig:robot-elements}{{1}{3}{Robot elements\relax }{figure.caption.3}{}}
+\newlabel{startup}{{3}{3}{Startup procedure}{section.3}{}}
+\@writefile{toc}{\contentsline {section}{\numberline {3} Startup procedure}{3}{section.3}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {3.1}Power on}{3}{subsection.3.1}}
+\newlabel{enable-security}{{{{2.}}}{3}{Power on}{Item.36}{}}
+\@writefile{lof}{\contentsline {figure}{\numberline {2}{\ignorespaces Front component power switch panel\relax }}{4}{figure.caption.4}}
+\newlabel{fig:component-panel-front}{{2}{4}{Front component power switch panel\relax }{figure.caption.4}{}}
+\@writefile{lof}{\contentsline {figure}{\numberline {3}{\ignorespaces Rear component power switch panel\relax }}{5}{figure.caption.5}}
+\newlabel{fig:component-panel-rear}{{3}{5}{Rear component power switch panel\relax }{figure.caption.5}{}}
+\@writefile{lof}{\contentsline {figure}{\numberline {4}{\ignorespaces Security system\relax }}{5}{figure.caption.6}}
+\newlabel{fig:security-system}{{4}{5}{Security system\relax }{figure.caption.6}{}}
+\@writefile{lof}{\contentsline {figure}{\numberline {5}{\ignorespaces Segway panel\relax }}{6}{figure.caption.7}}
+\newlabel{fig:segway-panel}{{5}{6}{Segway panel\relax }{figure.caption.7}{}}
+\@writefile{lof}{\contentsline {figure}{\numberline {6}{\ignorespaces Power switch\relax }}{6}{figure.caption.8}}
+\newlabel{fig:power-switch}{{6}{6}{Power switch\relax }{figure.caption.8}{}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {3.2}Attach robot covers}{6}{subsection.3.2}}
+\@writefile{lof}{\contentsline {figure}{\numberline {7}{\ignorespaces Arm calibration movements\relax }}{7}{figure.caption.10}}
+\newlabel{fig:arm-calibration}{{7}{7}{Arm calibration movements\relax }{figure.caption.10}{}}
+\@writefile{lof}{\contentsline {figure}{\numberline {8}{\ignorespaces Caster wheels\relax }}{7}{figure.caption.13}}
+\newlabel{fig:caster-wheels}{{8}{7}{Caster wheels\relax }{figure.caption.13}{}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {3.3}Remote access}{7}{subsection.3.3}}
+\@writefile{lof}{\contentsline {figure}{\numberline {9}{\ignorespaces Robot covers\relax }}{8}{figure.caption.17}}
+\newlabel{fig:robot-covers}{{9}{8}{Robot covers\relax }{figure.caption.17}{}}
+\@writefile{toc}{\contentsline {section}{\numberline {4}Operation procedure}{8}{section.4}}
+\newlabel{operation}{{4}{8}{Operation procedure}{section.4}{}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {4.1}Launch software}{8}{subsection.4.1}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {4.2}Running}{8}{subsection.4.2}}
+\@writefile{toc}{\contentsline {subsection}{\numberline {4.3}Security}{8}{subsection.4.3}}
+\citation{battery-procedure}
+\@writefile{toc}{\contentsline {subsection}{\numberline {4.4}Battery monitoring}{9}{subsection.4.4}}
+\@writefile{toc}{\contentsline {section}{\numberline {5}Shutdown procedure}{9}{section.5}}
+\newlabel{shutdown}{{5}{9}{Shutdown procedure}{section.5}{}}
+\newlabel{shutdown-software}{{{{1.}}}{9}{Shutdown procedure}{Item.75}{}}
+\newlabel{shutdown-segway}{{{{2.}}}{9}{Shutdown procedure}{Item.76}{}}
+\bibstyle{plain}
+\bibdata{references}
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.lof b/procedures/startup_operation_shutdown/startup_operation_shutdown.lof
new file mode 100644
index 0000000000000000000000000000000000000000..2af1659428ec9f2668b595984dd08a88c1da714d
--- /dev/null
+++ b/procedures/startup_operation_shutdown/startup_operation_shutdown.lof
@@ -0,0 +1,10 @@
+\select@language {english}
+\contentsline {figure}{\numberline {1}{\ignorespaces Robot elements\relax }}{3}{figure.caption.3}
+\contentsline {figure}{\numberline {2}{\ignorespaces Front component power switch panel\relax }}{4}{figure.caption.4}
+\contentsline {figure}{\numberline {3}{\ignorespaces Rear component power switch panel\relax }}{5}{figure.caption.5}
+\contentsline {figure}{\numberline {4}{\ignorespaces Security system\relax }}{5}{figure.caption.6}
+\contentsline {figure}{\numberline {5}{\ignorespaces Segway panel\relax }}{6}{figure.caption.7}
+\contentsline {figure}{\numberline {6}{\ignorespaces Power switch\relax }}{6}{figure.caption.8}
+\contentsline {figure}{\numberline {7}{\ignorespaces Arm calibration movements\relax }}{7}{figure.caption.10}
+\contentsline {figure}{\numberline {8}{\ignorespaces Caster wheels\relax }}{7}{figure.caption.13}
+\contentsline {figure}{\numberline {9}{\ignorespaces Robot covers\relax }}{8}{figure.caption.17}
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.log b/procedures/startup_operation_shutdown/startup_operation_shutdown.log
new file mode 100644
index 0000000000000000000000000000000000000000..83d8a1d56a002be8a27afee3ccb1e9f16a6a813c
--- /dev/null
+++ b/procedures/startup_operation_shutdown/startup_operation_shutdown.log
@@ -0,0 +1,637 @@
+This is pdfTeX, Version 3.14159265-2.6-1.40.16 (TeX Live 2015/Debian) (preloaded format=pdflatex 2019.3.8)  29 OCT 2019 15:07
+entering extended mode
+ restricted \write18 enabled.
+ %&-line parsing enabled.
+**startup_operation_shutdown.tex
+(./startup_operation_shutdown.tex
+LaTeX2e <2016/02/01>
+Babel <3.9q> and hyphenation patterns for 3 language(s) loaded.
+(/usr/share/texlive/texmf-dist/tex/latex/base/article.cls
+Document Class: article 2014/09/29 v1.4h Standard LaTeX document class
+(/usr/share/texlive/texmf-dist/tex/latex/base/size10.clo
+File: size10.clo 2014/09/29 v1.4h Standard LaTeX file (size option)
+)
+\c@part=\count79
+\c@section=\count80
+\c@subsection=\count81
+\c@subsubsection=\count82
+\c@paragraph=\count83
+\c@subparagraph=\count84
+\c@figure=\count85
+\c@table=\count86
+\abovecaptionskip=\skip41
+\belowcaptionskip=\skip42
+\bibindent=\dimen102
+)
+(/usr/share/texlive/texmf-dist/tex/generic/babel/babel.sty
+Package: babel 2016/02/24 3.9q The Babel package
+
+(/usr/share/texlive/texmf-dist/tex/generic/babel-english/english.ldf
+Language: english 2012/08/20 v3.3p English support from the babel system
+
+(/usr/share/texlive/texmf-dist/tex/generic/babel/babel.def
+File: babel.def 2016/02/24 3.9q Babel common definitions
+\babel@savecnt=\count87
+\U@D=\dimen103
+)
+\l@british = a dialect from \language\l@english 
+\l@UKenglish = a dialect from \language\l@english 
+\l@canadian = a dialect from \language\l@american 
+\l@australian = a dialect from \language\l@british 
+\l@newzealand = a dialect from \language\l@british 
+))
+(/usr/share/texlive/texmf-dist/tex/latex/base/inputenc.sty
+Package: inputenc 2015/03/17 v1.2c Input encoding file
+\inpenc@prehook=\toks14
+\inpenc@posthook=\toks15
+
+(/usr/share/texlive/texmf-dist/tex/latex/ucs/utf8x.def
+File: utf8x.def 2004/10/17 UCS: Input encoding UTF-8
+))
+(/usr/share/texlive/texmf-dist/tex/latex/ucs/ucs.sty
+Package: ucs 2013/05/11 v2.2 UCS: Unicode input support
+
+(/usr/share/texlive/texmf-dist/tex/latex/ucs/data/uni-global.def
+File: uni-global.def 2013/05/13 UCS: Unicode global data
+)
+\uc@secondtry=\count88
+\uc@combtoks=\toks16
+\uc@combtoksb=\toks17
+\uc@temptokena=\toks18
+)
+(/usr/share/texlive/texmf-dist/tex/latex/graphics/graphicx.sty
+Package: graphicx 2014/10/28 v1.0g Enhanced LaTeX Graphics (DPC,SPQR)
+
+(/usr/share/texlive/texmf-dist/tex/latex/graphics/keyval.sty
+Package: keyval 2014/10/28 v1.15 key=value parser (DPC)
+\KV@toks@=\toks19
+)
+(/usr/share/texlive/texmf-dist/tex/latex/graphics/graphics.sty
+Package: graphics 2016/01/03 v1.0q Standard LaTeX Graphics (DPC,SPQR)
+
+(/usr/share/texlive/texmf-dist/tex/latex/graphics/trig.sty
+Package: trig 2016/01/03 v1.10 sin cos tan (DPC)
+)
+(/usr/share/texlive/texmf-dist/tex/latex/latexconfig/graphics.cfg
+File: graphics.cfg 2010/04/23 v1.9 graphics configuration of TeX Live
+)
+Package graphics Info: Driver file: pdftex.def on input line 95.
+
+(/usr/share/texlive/texmf-dist/tex/latex/pdftex-def/pdftex.def
+File: pdftex.def 2011/05/27 v0.06d Graphics/color for pdfTeX
+
+(/usr/share/texlive/texmf-dist/tex/generic/oberdiek/infwarerr.sty
+Package: infwarerr 2010/04/08 v1.3 Providing info/warning/error messages (HO)
+)
+(/usr/share/texlive/texmf-dist/tex/generic/oberdiek/ltxcmds.sty
+Package: ltxcmds 2011/11/09 v1.22 LaTeX kernel commands for general use (HO)
+)
+\Gread@gobject=\count89
+))
+\Gin@req@height=\dimen104
+\Gin@req@width=\dimen105
+)
+(/usr/share/texlive/texmf-dist/tex/latex/caption/caption.sty
+Package: caption 2016/02/21 v3.3-144 Customizing captions (AR)
+
+(/usr/share/texlive/texmf-dist/tex/latex/caption/caption3.sty
+Package: caption3 2016/02/04 v1.7-139 caption3 kernel (AR)
+Package caption3 Info: TeX engine: e-TeX on input line 67.
+\captionmargin=\dimen106
+\captionmargin@=\dimen107
+\captionwidth=\dimen108
+\caption@tempdima=\dimen109
+\caption@indent=\dimen110
+\caption@parindent=\dimen111
+\caption@hangindent=\dimen112
+)
+\c@ContinuedFloat=\count90
+)
+(/usr/share/texlive/texmf-dist/tex/latex/caption/subcaption.sty
+Package: subcaption 2016/02/20 v1.1-142 Sub-captions (AR)
+\c@subfigure=\count91
+\c@subtable=\count92
+)
+(/usr/share/texlive/texmf-dist/tex/latex/wrapfig/wrapfig.sty
+\wrapoverhang=\dimen113
+\WF@size=\dimen114
+\c@WF@wrappedlines=\count93
+\WF@box=\box26
+\WF@everypar=\toks20
+Package: wrapfig 2003/01/31  v 3.6
+)
+(/usr/share/texlive/texmf-dist/tex/latex/multirow/multirow.sty
+\bigstrutjot=\dimen115
+)
+(/usr/share/texlive/texmf-dist/tex/latex/tools/multicol.sty
+Package: multicol 2015/08/19 v1.8n multicolumn formatting (FMi)
+\c@tracingmulticols=\count94
+\mult@box=\box27
+\multicol@leftmargin=\dimen116
+\c@unbalance=\count95
+\c@collectmore=\count96
+\doublecol@number=\count97
+\multicoltolerance=\count98
+\multicolpretolerance=\count99
+\full@width=\dimen117
+\page@free=\dimen118
+\premulticols=\dimen119
+\postmulticols=\dimen120
+\multicolsep=\skip43
+\multicolbaselineskip=\skip44
+\partial@page=\box28
+\last@line=\box29
+\maxbalancingoverflow=\dimen121
+\mult@rightbox=\box30
+\mult@grightbox=\box31
+\mult@gfirstbox=\box32
+\mult@firstbox=\box33
+\@tempa=\box34
+\@tempa=\box35
+\@tempa=\box36
+\@tempa=\box37
+\@tempa=\box38
+\@tempa=\box39
+\@tempa=\box40
+\@tempa=\box41
+\@tempa=\box42
+\@tempa=\box43
+\@tempa=\box44
+\@tempa=\box45
+\@tempa=\box46
+\@tempa=\box47
+\@tempa=\box48
+\@tempa=\box49
+\@tempa=\box50
+\c@columnbadness=\count100
+\c@finalcolumnbadness=\count101
+\last@try=\dimen122
+\multicolovershoot=\dimen123
+\multicolundershoot=\dimen124
+\mult@nat@firstbox=\box51
+\colbreak@box=\box52
+\mc@col@check@num=\count102
+)
+(/usr/share/texlive/texmf-dist/tex/latex/hyperref/hyperref.sty
+Package: hyperref 2012/11/06 v6.83m Hypertext links for LaTeX
+
+(/usr/share/texlive/texmf-dist/tex/generic/oberdiek/hobsub-hyperref.sty
+Package: hobsub-hyperref 2012/05/28 v1.13 Bundle oberdiek, subset hyperref (HO)
+
+
+(/usr/share/texlive/texmf-dist/tex/generic/oberdiek/hobsub-generic.sty
+Package: hobsub-generic 2012/05/28 v1.13 Bundle oberdiek, subset generic (HO)
+Package: hobsub 2012/05/28 v1.13 Construct package bundles (HO)
+Package hobsub Info: Skipping package `infwarerr' (already loaded).
+Package hobsub Info: Skipping package `ltxcmds' (already loaded).
+Package: ifluatex 2010/03/01 v1.3 Provides the ifluatex switch (HO)
+Package ifluatex Info: LuaTeX not detected.
+Package: ifvtex 2010/03/01 v1.5 Detect VTeX and its facilities (HO)
+Package ifvtex Info: VTeX not detected.
+Package: intcalc 2007/09/27 v1.1 Expandable calculations with integers (HO)
+Package: ifpdf 2011/01/30 v2.3 Provides the ifpdf switch (HO)
+Package ifpdf Info: pdfTeX in PDF mode is detected.
+Package: etexcmds 2011/02/16 v1.5 Avoid name clashes with e-TeX commands (HO)
+Package etexcmds Info: Could not find \expanded.
+(etexcmds)             That can mean that you are not using pdfTeX 1.50 or
+(etexcmds)             that some package has redefined \expanded.
+(etexcmds)             In the latter case, load this package earlier.
+Package: kvsetkeys 2012/04/25 v1.16 Key value parser (HO)
+Package: kvdefinekeys 2011/04/07 v1.3 Define keys (HO)
+Package: pdftexcmds 2011/11/29 v0.20 Utility functions of pdfTeX for LuaTeX (HO
+)
+Package pdftexcmds Info: LuaTeX not detected.
+Package pdftexcmds Info: \pdf@primitive is available.
+Package pdftexcmds Info: \pdf@ifprimitive is available.
+Package pdftexcmds Info: \pdfdraftmode found.
+Package: pdfescape 2011/11/25 v1.13 Implements pdfTeX's escape features (HO)
+Package: bigintcalc 2012/04/08 v1.3 Expandable calculations on big integers (HO
+)
+Package: bitset 2011/01/30 v1.1 Handle bit-vector datatype (HO)
+Package: uniquecounter 2011/01/30 v1.2 Provide unlimited unique counter (HO)
+)
+Package hobsub Info: Skipping package `hobsub' (already loaded).
+Package: letltxmacro 2010/09/02 v1.4 Let assignment for LaTeX macros (HO)
+Package: hopatch 2012/05/28 v1.2 Wrapper for package hooks (HO)
+Package: xcolor-patch 2011/01/30 xcolor patch
+Package: atveryend 2011/06/30 v1.8 Hooks at the very end of document (HO)
+Package atveryend Info: \enddocument detected (standard20110627).
+Package: atbegshi 2011/10/05 v1.16 At begin shipout hook (HO)
+Package: refcount 2011/10/16 v3.4 Data extraction from label references (HO)
+Package: hycolor 2011/01/30 v1.7 Color options for hyperref/bookmark (HO)
+)
+(/usr/share/texlive/texmf-dist/tex/generic/ifxetex/ifxetex.sty
+Package: ifxetex 2010/09/12 v0.6 Provides ifxetex conditional
+)
+(/usr/share/texlive/texmf-dist/tex/latex/oberdiek/auxhook.sty
+Package: auxhook 2011/03/04 v1.3 Hooks for auxiliary files (HO)
+)
+(/usr/share/texlive/texmf-dist/tex/latex/oberdiek/kvoptions.sty
+Package: kvoptions 2011/06/30 v3.11 Key value format for package options (HO)
+)
+\@linkdim=\dimen125
+\Hy@linkcounter=\count103
+\Hy@pagecounter=\count104
+
+(/usr/share/texlive/texmf-dist/tex/latex/hyperref/pd1enc.def
+File: pd1enc.def 2012/11/06 v6.83m Hyperref: PDFDocEncoding definition (HO)
+)
+\Hy@SavedSpaceFactor=\count105
+
+(/usr/share/texlive/texmf-dist/tex/latex/latexconfig/hyperref.cfg
+File: hyperref.cfg 2002/06/06 v1.2 hyperref configuration of TeXLive
+)
+Package hyperref Info: Hyper figures OFF on input line 4443.
+Package hyperref Info: Link nesting OFF on input line 4448.
+Package hyperref Info: Hyper index ON on input line 4451.
+Package hyperref Info: Plain pages OFF on input line 4458.
+Package hyperref Info: Backreferencing OFF on input line 4463.
+Package hyperref Info: Implicit mode ON; LaTeX internals redefined.
+Package hyperref Info: Bookmarks ON on input line 4688.
+\c@Hy@tempcnt=\count106
+
+(/usr/share/texlive/texmf-dist/tex/latex/url/url.sty
+\Urlmuskip=\muskip10
+Package: url 2013/09/16  ver 3.4  Verb mode for urls, etc.
+)
+LaTeX Info: Redefining \url on input line 5041.
+\XeTeXLinkMargin=\dimen126
+\Fld@menulength=\count107
+\Field@Width=\dimen127
+\Fld@charsize=\dimen128
+Package hyperref Info: Hyper figures OFF on input line 6295.
+Package hyperref Info: Link nesting OFF on input line 6300.
+Package hyperref Info: Hyper index ON on input line 6303.
+Package hyperref Info: backreferencing OFF on input line 6310.
+Package hyperref Info: Link coloring OFF on input line 6315.
+Package hyperref Info: Link coloring with OCG OFF on input line 6320.
+Package hyperref Info: PDF/A mode OFF on input line 6325.
+LaTeX Info: Redefining \ref on input line 6365.
+LaTeX Info: Redefining \pageref on input line 6369.
+\Hy@abspage=\count108
+\c@Item=\count109
+\c@Hfootnote=\count110
+)
+
+Package hyperref Message: Driver (autodetected): hpdftex.
+
+(/usr/share/texlive/texmf-dist/tex/latex/hyperref/hpdftex.def
+File: hpdftex.def 2012/11/06 v6.83m Hyperref driver for pdfTeX
+\Fld@listcount=\count111
+\c@bookmark@seq@number=\count112
+
+(/usr/share/texlive/texmf-dist/tex/latex/oberdiek/rerunfilecheck.sty
+Package: rerunfilecheck 2011/04/15 v1.7 Rerun checks for auxiliary files (HO)
+Package uniquecounter Info: New unique counter `rerunfilecheck' on input line 2
+82.
+)
+\Hy@SectionHShift=\skip45
+)
+(/usr/share/texlive/texmf-dist/tex/latex/natbib/natbib.sty
+Package: natbib 2010/09/13 8.31b (PWD, AO)
+\bibhang=\skip46
+\bibsep=\skip47
+LaTeX Info: Redefining \cite on input line 694.
+\c@NAT@ctr=\count113
+)
+(/usr/share/texlive/texmf-dist/tex/latex/enumitem/enumitem.sty
+Package: enumitem 2011/09/28 v3.5.2 Customized lists
+\labelindent=\skip48
+\enit@outerparindent=\dimen129
+\enit@toks=\toks21
+\enit@inbox=\box53
+\enitdp@description=\count114
+)
+(./startup_operation_shutdown.aux)
+\openout1 = `startup_operation_shutdown.aux'.
+
+LaTeX Font Info:    Checking defaults for OML/cmm/m/it on input line 44.
+LaTeX Font Info:    ... okay on input line 44.
+LaTeX Font Info:    Checking defaults for T1/cmr/m/n on input line 44.
+LaTeX Font Info:    ... okay on input line 44.
+LaTeX Font Info:    Checking defaults for OT1/cmr/m/n on input line 44.
+LaTeX Font Info:    ... okay on input line 44.
+LaTeX Font Info:    Checking defaults for OMS/cmsy/m/n on input line 44.
+LaTeX Font Info:    ... okay on input line 44.
+LaTeX Font Info:    Checking defaults for OMX/cmex/m/n on input line 44.
+LaTeX Font Info:    ... okay on input line 44.
+LaTeX Font Info:    Checking defaults for U/cmr/m/n on input line 44.
+LaTeX Font Info:    ... okay on input line 44.
+LaTeX Font Info:    Checking defaults for PD1/pdf/m/n on input line 44.
+LaTeX Font Info:    ... okay on input line 44.
+
+(/usr/share/texlive/texmf-dist/tex/latex/ucs/ucsencs.def
+File: ucsencs.def 2011/01/21 Fixes to fontencodings LGR, T3
+)
+(/usr/share/texlive/texmf-dist/tex/context/base/supp-pdf.mkii
+[Loading MPS to PDF converter (version 2006.09.02).]
+\scratchcounter=\count115
+\scratchdimen=\dimen130
+\scratchbox=\box54
+\nofMPsegments=\count116
+\nofMParguments=\count117
+\everyMPshowfont=\toks22
+\MPscratchCnt=\count118
+\MPscratchDim=\dimen131
+\MPnumerator=\count119
+\makeMPintoPDFobject=\count120
+\everyMPtoPDFconversion=\toks23
+) (/usr/share/texlive/texmf-dist/tex/latex/oberdiek/epstopdf-base.sty
+Package: epstopdf-base 2010/02/09 v2.5 Base part for package epstopdf
+
+(/usr/share/texlive/texmf-dist/tex/latex/oberdiek/grfext.sty
+Package: grfext 2010/08/19 v1.1 Manage graphics extensions (HO)
+)
+Package grfext Info: Graphics extension search list:
+(grfext)             [.png,.pdf,.jpg,.mps,.jpeg,.jbig2,.jb2,.PNG,.PDF,.JPG,.JPE
+G,.JBIG2,.JB2,.eps]
+(grfext)             \AppendGraphicsExtensions on input line 452.
+
+(/usr/share/texlive/texmf-dist/tex/latex/latexconfig/epstopdf-sys.cfg
+File: epstopdf-sys.cfg 2010/07/13 v1.3 Configuration of (r)epstopdf for TeX Liv
+e
+))
+Package caption Info: Begin \AtBeginDocument code.
+Package caption Info: hyperref package is loaded.
+Package caption Info: wrapfig package is loaded.
+Package caption Info: End \AtBeginDocument code.
+\AtBeginShipoutBox=\box55
+Package hyperref Info: Link coloring OFF on input line 44.
+
+(/usr/share/texlive/texmf-dist/tex/latex/hyperref/nameref.sty
+Package: nameref 2012/10/27 v2.43 Cross-referencing by name of section
+
+(/usr/share/texlive/texmf-dist/tex/generic/oberdiek/gettitlestring.sty
+Package: gettitlestring 2010/12/03 v1.4 Cleanup title references (HO)
+)
+\c@section@level=\count121
+)
+LaTeX Info: Redefining \ref on input line 44.
+LaTeX Info: Redefining \pageref on input line 44.
+LaTeX Info: Redefining \nameref on input line 44.
+
+(./startup_operation_shutdown.out) (./startup_operation_shutdown.out)
+\@outlinefile=\write3
+\openout3 = `startup_operation_shutdown.out'.
+
+LaTeX Font Info:    External font `cmex10' loaded for size
+(Font)              <12> on input line 47.
+LaTeX Font Info:    External font `cmex10' loaded for size
+(Font)              <8> on input line 47.
+LaTeX Font Info:    External font `cmex10' loaded for size
+(Font)              <6> on input line 47.
+
+(./startup_operation_shutdown.toc
+LaTeX Font Info:    External font `cmex10' loaded for size
+(Font)              <7> on input line 4.
+LaTeX Font Info:    External font `cmex10' loaded for size
+(Font)              <5> on input line 4.
+)
+\tf@toc=\write4
+\openout4 = `startup_operation_shutdown.toc'.
+
+ (./startup_operation_shutdown.lof)
+\tf@lof=\write5
+\openout5 = `startup_operation_shutdown.lof'.
+
+ [1
+
+{/var/lib/texmf/fonts/map/pdftex/updmap/pdftex.map}]
+
+Package natbib Warning: Citation `tibidabo' on page 2 undefined on input line 5
+5.
+
+<../common_images/attention.png, id=104, 235.88126pt x 215.80624pt>
+File: ../common_images/attention.png Graphic file (type png)
+
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 65.
+(pdftex.def)             Requested size: 11.99991pt x 10.97864pt.
+
+
+Package natbib Warning: Citation `safety-sheets' on page 2 undefined on input l
+ine 65.
+
+<./images/robot-elements.png, id=106, 855.195pt x 513.92pt>
+File: ./images/robot-elements.png Graphic file (type png)
+
+<use ./images/robot-elements.png>
+Package pdftex.def Info: ./images/robot-elements.png used on input line 93.
+(pdftex.def)             Requested size: 276.00105pt x 165.85359pt.
+LaTeX Font Info:    Try loading font information for OMS+cmr on input line 101.
+
+
+(/usr/share/texlive/texmf-dist/tex/latex/base/omscmr.fd
+File: omscmr.fd 2014/09/29 v2.5h Standard LaTeX font definitions
+)
+LaTeX Font Info:    Font shape `OMS/cmr/m/n' in size <10> not available
+(Font)              Font shape `OMS/cmsy/m/n' tried instead on input line 101.
+ [2 <../common_images/attention.png>] <./images/front-panel.png, id=131, 386.44
+376pt x 289.08pt>
+File: ./images/front-panel.png Graphic file (type png)
+
+<use ./images/front-panel.png>
+Package pdftex.def Info: ./images/front-panel.png used on input line 137.
+(pdftex.def)             Requested size: 276.00105pt x 206.46567pt.
+
+<./images/rear-panel.png, id=132, 460.72125pt x 270.00874pt>
+File: ./images/rear-panel.png Graphic file (type png)
+
+<use ./images/rear-panel.png>
+Package pdftex.def Info: ./images/rear-panel.png used on input line 144.
+(pdftex.def)             Requested size: 276.00105pt x 161.75104pt.
+
+<./images/security-system.png, id=134, 752.8125pt x 310.15875pt>
+File: ./images/security-system.png Graphic file (type png)
+
+<use ./images/security-system.png>
+Package pdftex.def Info: ./images/security-system.png used on input line 153.
+(pdftex.def)             Requested size: 276.00105pt x 113.71576pt.
+
+<./images/segway-panel.png, id=136, 512.91624pt x 317.185pt>
+File: ./images/segway-panel.png Graphic file (type png)
+
+<use ./images/segway-panel.png>
+Package pdftex.def Info: ./images/segway-panel.png used on input line 162.
+(pdftex.def)             Requested size: 276.00105pt x 170.67719pt.
+
+<./images/power-button.png, id=138, 706.64pt x 305.14pt>
+File: ./images/power-button.png Graphic file (type png)
+
+<use ./images/power-button.png>
+Package pdftex.def Info: ./images/power-button.png used on input line 180.
+(pdftex.def)             Requested size: 276.00105pt x 119.18105pt.
+File: ../common_images/attention.png Graphic file (type png)
+ <use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 188.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 188--188
+[][] 
+ []
+
+
+Package natbib Warning: Citation `battery-procedure' on page 3 undefined on inp
+ut line 190.
+
+[3 <./images/robot-elements.png>]
+<./images/arm-calibration.png, id=172, 884.30376pt x 273.02pt>
+File: ./images/arm-calibration.png Graphic file (type png)
+
+<use ./images/arm-calibration.png>
+Package pdftex.def Info: ./images/arm-calibration.png used on input line 201.
+(pdftex.def)             Requested size: 276.00105pt x 85.21439pt.
+
+(/usr/share/texlive/texmf-dist/tex/latex/ucs/data/uni-32.def
+File: uni-32.def 2013/05/13 UCS: Unicode data U+2000..U+20FF
+)
+File: ../common_images/attention.png Graphic file (type png)
+
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 212.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 212--212
+[][] 
+ []
+
+File: ../common_images/attention.png Graphic file (type png)
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 217.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 217--217
+[][] 
+ []
+
+[4 <./images/front-panel.png>]
+<./images/caster-wheels.png, id=191, 318.18875pt x 308.15125pt>
+File: ./images/caster-wheels.png Graphic file (type png)
+
+<use ./images/caster-wheels.png>
+Package pdftex.def Info: ./images/caster-wheels.png used on input line 224.
+(pdftex.def)             Requested size: 276.00105pt x 267.29477pt.
+File: ../common_images/attention.png Graphic file (type png)
+ <use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 229.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 229--229
+[][] 
+ []
+
+File: ../common_images/attention.png Graphic file (type png)
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 239.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 239--239
+[][] 
+ []
+
+File: ../common_images/attention.png Graphic file (type png)
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 241.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 241--241
+[][] 
+ []
+
+[5 <./images/rear-panel.png> <./images/security-system.png>] [6 <./images/segwa
+y-panel.png> <./images/power-button.png>]
+<./images/robot-covers.png, id=211, 484.81125pt x 257.96375pt>
+File: ./images/robot-covers.png Graphic file (type png)
+
+<use ./images/robot-covers.png>
+Package pdftex.def Info: ./images/robot-covers.png used on input line 252.
+(pdftex.def)             Requested size: 276.00105pt x 146.86372pt.
+ [7 <./images/arm-calibration.png> <./images/caster-wheels.png>]
+File: ../common_images/attention.png Graphic file (type png)
+ <use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 291.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 291--291
+[][] 
+ []
+
+File: ../common_images/attention.png Graphic file (type png)
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 293.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 293--293
+[][] 
+ []
+
+File: ../common_images/attention.png Graphic file (type png)
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 302.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 302--302
+[][] 
+ []
+
+[8 <./images/robot-covers.png>]
+
+Package natbib Warning: Citation `battery-procedure' on page 9 undefined on inp
+ut line 319.
+
+File: ../common_images/attention.png Graphic file (type png)
+<use ../common_images/attention.png>
+Package pdftex.def Info: ../common_images/attention.png used on input line 336.
+
+(pdftex.def)             Requested size: 22.76228pt x 20.82451pt.
+
+Overfull \hbox (10.20232pt too wide) in paragraph at lines 336--336
+[][] 
+ []
+
+[9] [10]
+No file startup_operation_shutdown.bbl.
+
+Package natbib Warning: There were undefined citations.
+
+Package atveryend Info: Empty hook `BeforeClearDocument' on input line 359.
+Package atveryend Info: Empty hook `AfterLastShipout' on input line 359.
+(./startup_operation_shutdown.aux)
+Package atveryend Info: Executing hook `AtVeryEndDocument' on input line 359.
+Package atveryend Info: Executing hook `AtEndAfterFileList' on input line 359.
+Package rerunfilecheck Info: File `startup_operation_shutdown.out' has not chan
+ged.
+(rerunfilecheck)             Checksum: 3B229823E00DE6B5CACB811B426568FC;824.
+Package atveryend Info: Empty hook `AtVeryVeryEnd' on input line 359.
+ ) 
+Here is how much of TeX's memory you used:
+ 8058 strings out of 494953
+ 122722 string characters out of 6180978
+ 224726 words of memory out of 5000000
+ 11113 multiletter control sequences out of 15000+600000
+ 8241 words of font info for 29 fonts, out of 8000000 for 9000
+ 14 hyphenation exceptions out of 8191
+ 36i,14n,39p,442b,771s stack positions out of 5000i,500n,10000p,200000b,80000s
+</usr/share/texlive/texmf-dist/fonts/type1/public/amsfonts/cm/cmbx10.pfb></us
+r/share/texlive/texmf-dist/fonts/type1/public/amsfonts/cm/cmbx12.pfb></usr/shar
+e/texlive/texmf-dist/fonts/type1/public/amsfonts/cm/cmr10.pfb></usr/share/texli
+ve/texmf-dist/fonts/type1/public/amsfonts/cm/cmr12.pfb></usr/share/texlive/texm
+f-dist/fonts/type1/public/amsfonts/cm/cmr17.pfb></usr/share/texlive/texmf-dist/
+fonts/type1/public/amsfonts/cm/cmsy10.pfb></usr/share/texlive/texmf-dist/fonts/
+type1/public/amsfonts/cm/cmti10.pfb>
+Output written on startup_operation_shutdown.pdf (10 pages, 959673 bytes).
+PDF statistics:
+ 332 PDF objects out of 1000 (max. 8388607)
+ 299 compressed objects within 3 object streams
+ 134 named destinations out of 1000 (max. 500000)
+ 163 words of extra memory for PDF output out of 10000 (max. 10000000)
+
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.out b/procedures/startup_operation_shutdown/startup_operation_shutdown.out
new file mode 100644
index 0000000000000000000000000000000000000000..5be914e58ddfdc99ebaff3053ba1953721e5b268
--- /dev/null
+++ b/procedures/startup_operation_shutdown/startup_operation_shutdown.out
@@ -0,0 +1,14 @@
+\BOOKMARK [1][-]{section.1}{Description}{}% 1
+\BOOKMARK [1][-]{section.2}{Preliminary considerations}{}% 2
+\BOOKMARK [2][-]{subsection.2.1}{Safety}{section.2}% 3
+\BOOKMARK [2][-]{subsection.2.2}{Robot description}{section.2}% 4
+\BOOKMARK [1][-]{section.3}{ Startup procedure}{}% 5
+\BOOKMARK [2][-]{subsection.3.1}{Power on}{section.3}% 6
+\BOOKMARK [2][-]{subsection.3.2}{Attach robot covers}{section.3}% 7
+\BOOKMARK [2][-]{subsection.3.3}{Remote access}{section.3}% 8
+\BOOKMARK [1][-]{section.4}{Operation procedure}{}% 9
+\BOOKMARK [2][-]{subsection.4.1}{Launch software}{section.4}% 10
+\BOOKMARK [2][-]{subsection.4.2}{Running}{section.4}% 11
+\BOOKMARK [2][-]{subsection.4.3}{Security}{section.4}% 12
+\BOOKMARK [2][-]{subsection.4.4}{Battery monitoring}{section.4}% 13
+\BOOKMARK [1][-]{section.5}{Shutdown procedure}{}% 14
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.pdf b/procedures/startup_operation_shutdown/startup_operation_shutdown.pdf
new file mode 100644
index 0000000000000000000000000000000000000000..ff29bca0d34a20ef5971ace7e97f14844f4cda01
Binary files /dev/null and b/procedures/startup_operation_shutdown/startup_operation_shutdown.pdf differ
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.synctex.gz b/procedures/startup_operation_shutdown/startup_operation_shutdown.synctex.gz
new file mode 100644
index 0000000000000000000000000000000000000000..399d1a7fb2880bd580a94ae87a2eb43698752697
Binary files /dev/null and b/procedures/startup_operation_shutdown/startup_operation_shutdown.synctex.gz differ
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.tex b/procedures/startup_operation_shutdown/startup_operation_shutdown.tex
index d64dd533ebfbaed7c9349c8c8beba9487657ac60..463759762f6383a77b74211b73e28a85506503c3 100644
--- a/procedures/startup_operation_shutdown/startup_operation_shutdown.tex
+++ b/procedures/startup_operation_shutdown/startup_operation_shutdown.tex
@@ -90,7 +90,7 @@ Tibi and Dabo are custom robots designed at IRI. See Fig.\ref{fig:robot-elements
 
 \begin{figure}[ht!]
   \centering
-  \includegraphics[width=.8\linewidth]{example-image}
+  \includegraphics[width=.8\linewidth]{robot-elements.png}
   \caption{Robot elements}
   \label{fig:robot-elements}
 \end{figure}
@@ -134,14 +134,14 @@ To choose which components are powered on or off, front and rear power switch pa
 
 \begin{figure}[ht]
     \centering
-    \includegraphics[width=.8\linewidth]{example-image}
+    \includegraphics[width=.8\linewidth]{front-panel.png}
     \caption{Front component power switch panel}
     \label{fig:component-panel-front}
 \end{figure}
 
 \begin{figure}[ht]
     \centering
-    \includegraphics[width=.8\linewidth]{example-image}
+    \includegraphics[width=.8\linewidth]{rear-panel.png}
     \caption{Rear component power switch panel}
     \label{fig:component-panel-rear}
 \end{figure}
@@ -150,7 +150,7 @@ The emergency stop system consists in an onboard receiver and a remote emitter.
 
 \begin{figure}[ht]
     \centering
-    \includegraphics[width=.8\linewidth]{example-image}
+    \includegraphics[width=.8\linewidth]{security-system.png}
     \caption{Security system}
     \label{fig:security-system}
 \end{figure}
@@ -159,7 +159,7 @@ The Segway RMP 200 platform has a rear panel shown in Fig.\ref{fig:segway-panel}
 		
     \begin{figure}[ht]
         \centering
-        \includegraphics[width=.8\linewidth]{example-image}
+        \includegraphics[width=.8\linewidth]{segway-panel.png}
         \caption{Segway panel}
         \label{fig:segway-panel}
     \end{figure}
@@ -177,7 +177,7 @@ The Segway RMP 200 platform has a rear panel shown in Fig.\ref{fig:segway-panel}
 
     \begin{figure}[ht]
         \centering
-        \includegraphics[width=.8\linewidth]{example-image}
+        \includegraphics[width=.8\linewidth]{power-button.png}
         \caption{Power switch}
         \label{fig:power-switch}
     \end{figure}	
@@ -198,7 +198,7 @@ The Segway RMP 200 platform has a rear panel shown in Fig.\ref{fig:segway-panel}
 	
     \begin{figure}[ht]
         \centering
-        \includegraphics[width=.8\linewidth]{example-image}
+        \includegraphics[width=.8\linewidth]{arm-calibration.png}
         \caption{Arm calibration movements}
         \label{fig:arm-calibration}
     \end{figure}
@@ -221,7 +221,7 @@ The Segway RMP 200 platform has a rear panel shown in Fig.\ref{fig:segway-panel}
 			
             \begin{figure}[ht]
                 \centering
-                \includegraphics[width=.8\linewidth]{example-image}
+                \includegraphics[width=.8\linewidth]{caster-wheels.png}
                 \caption{Caster wheels}
                 \label{fig:caster-wheels}
             \end{figure}
@@ -249,7 +249,7 @@ The Segway RMP 200 platform has a rear panel shown in Fig.\ref{fig:segway-panel}
 
     \begin{figure}[ht]
         \centering
-        \includegraphics[width=.8\linewidth]{example-image}
+        \includegraphics[width=.8\linewidth]{robot-covers.png}
         \caption{Robot covers}
         \label{fig:robot-covers}
     \end{figure}
diff --git a/procedures/startup_operation_shutdown/startup_operation_shutdown.toc b/procedures/startup_operation_shutdown/startup_operation_shutdown.toc
new file mode 100644
index 0000000000000000000000000000000000000000..8f85ad319b39ff08885487ef1ce7fdc43753c076
--- /dev/null
+++ b/procedures/startup_operation_shutdown/startup_operation_shutdown.toc
@@ -0,0 +1,15 @@
+\select@language {english}
+\contentsline {section}{\numberline {1}Description}{2}{section.1}
+\contentsline {section}{\numberline {2}Preliminary considerations}{2}{section.2}
+\contentsline {subsection}{\numberline {2.1}Safety}{2}{subsection.2.1}
+\contentsline {subsection}{\numberline {2.2}Robot description}{2}{subsection.2.2}
+\contentsline {section}{\numberline {3} Startup procedure}{3}{section.3}
+\contentsline {subsection}{\numberline {3.1}Power on}{3}{subsection.3.1}
+\contentsline {subsection}{\numberline {3.2}Attach robot covers}{6}{subsection.3.2}
+\contentsline {subsection}{\numberline {3.3}Remote access}{7}{subsection.3.3}
+\contentsline {section}{\numberline {4}Operation procedure}{8}{section.4}
+\contentsline {subsection}{\numberline {4.1}Launch software}{8}{subsection.4.1}
+\contentsline {subsection}{\numberline {4.2}Running}{8}{subsection.4.2}
+\contentsline {subsection}{\numberline {4.3}Security}{8}{subsection.4.3}
+\contentsline {subsection}{\numberline {4.4}Battery monitoring}{9}{subsection.4.4}
+\contentsline {section}{\numberline {5}Shutdown procedure}{9}{section.5}