|
83 | 83 | - Getting Started:
|
84 | 84 | - Technical Requirements: technical_requirements.md
|
85 | 85 | - Components: components.md
|
| 86 | + - Hardware Setup: |
| 87 | + - hardware_setup/overview.md |
| 88 | + - 3D Printing: hardware_setup/3D_print.md |
| 89 | + - Electronics: hardware_setup/electronics.md |
| 90 | + - Assembly: hardware_setup/assembly.md |
| 91 | + - Install: hardware_setup/install.md |
| 92 | + - Processing Units: |
| 93 | + - Single Board Computer: |
| 94 | + - Raspberry Pi Setup: rpi-setup.md |
| 95 | + - Jetson Nano Setup: jetson-nano-setup.md |
| 96 | + - Git Setup: git-setup.md |
| 97 | + - ROS Setup: ros-setup.md |
| 98 | + - Microcontroller: packages/diffbot_base/scripts/teensy-mcu.md |
| 99 | + - Hardware Interfaces: hardware-interfaces.md |
| 100 | + - ROS Network Setup: ros-network-setup.md |
| 101 | + - ROS Software Packages: |
| 102 | + - packages/index.md |
| 103 | + - Packages: packages.md |
| 104 | + - Robot Package: diffbot_robot.md |
| 105 | + - Robot Description: |
| 106 | + - Robot Description: robot-description.md |
| 107 | + - Remo Description: packages/remo_description.md |
| 108 | + - Simulation: diffbot_gazebo.md |
| 109 | + - Control: diffbot_control.md |
| 110 | + - Base Hardware Interface: |
| 111 | + - packages/diffbot_base/index.md |
| 112 | + - PID Controllers: packages/diffbot_base/pid.md |
| 113 | + - Low-Level PID Approach: packages/diffbot_base/low-level.md |
| 114 | + - High-Level PID Approach: packages/diffbot_base/high-level.md |
| 115 | + - Messages: diffbot_msgs.md |
| 116 | + - Motor Driver: grove_motor_driver.md |
| 117 | + - Motor and Encoder: DG01D-E-motor-with-encoder.md |
| 118 | + - Navigation: diffbot_navigation.md |
| 119 | + - SLAM: diffbot_slam.md |
| 120 | + - Move Base Flex: diffbot_mbf.md |
| 121 | + - Hardware Bringup: diffbot_bringup.md |
| 122 | + - Rasperry Pi Camera: packages/raspicam_node.md |
| 123 | + - Inertial Measurement Unit: |
| 124 | + - Robot Localization: packages/imu/robot_localization.md |
| 125 | + - BNO055 Driver: packages/imu/driver-bno055.md |
86 | 126 | - Robotics Theory:
|
87 | 127 | - theory/index.md
|
88 | 128 | - Preliminaries:
|
@@ -128,37 +168,4 @@ nav:
|
128 | 168 | - Motion and Odometry: theory/motion-and-odometry.md
|
129 | 169 | - Power Supply: power-supply.md
|
130 | 170 | - Laser Range Scanner: laser-range-scanner.md
|
131 |
| - - Processing Units: |
132 |
| - - Single Board Computer: |
133 |
| - - Raspberry Pi Setup: rpi-setup.md |
134 |
| - - Jetson Nano Setup: jetson-nano-setup.md |
135 |
| - - Git Setup: git-setup.md |
136 |
| - - ROS Setup: ros-setup.md |
137 |
| - - Microcontroller: packages/diffbot_base/scripts/teensy-mcu.md |
138 |
| - - Hardware Interfaces: hardware-interfaces.md |
139 |
| - - ROS Network Setup: ros-network-setup.md |
140 |
| - - Packages: |
141 |
| - - packages/index.md |
142 |
| - - Robot Package: diffbot_robot.md |
143 |
| - - Robot Description: |
144 |
| - - Robot Description: robot-description.md |
145 |
| - - Remo Description: packages/remo_description.md |
146 |
| - - Simulation: diffbot_gazebo.md |
147 |
| - - Control: diffbot_control.md |
148 |
| - - Base Hardware Interface: |
149 |
| - - packages/diffbot_base/index.md |
150 |
| - - PID Controllers: packages/diffbot_base/pid.md |
151 |
| - - Low-Level PID Approach: packages/diffbot_base/low-level.md |
152 |
| - - High-Level PID Approach: packages/diffbot_base/high-level.md |
153 |
| - - Messages: diffbot_msgs.md |
154 |
| - - Motor Driver: grove_motor_driver.md |
155 |
| - - Motor and Encoder: DG01D-E-motor-with-encoder.md |
156 |
| - - Navigation: diffbot_navigation.md |
157 |
| - - SLAM: diffbot_slam.md |
158 |
| - - Move Base Flex: diffbot_mbf.md |
159 |
| - - Hardware Bringup: diffbot_bringup.md |
160 |
| - - Rasperry Pi Camera: packages/raspicam_node.md |
161 |
| - - Inertial Measurement Unit: |
162 |
| - - Robot Localization: packages/imu/robot_localization.md |
163 |
| - - BNO055 Driver: packages/imu/driver-bno055.md |
164 | 171 | - Insiders: insiders/index.md
|
0 commit comments