Skip to content

Commit 6f70c9e

Browse files
committed
[#4] update mkdocs nav for hw setup
1 parent 352478c commit 6f70c9e

File tree

1 file changed

+35
-29
lines changed

1 file changed

+35
-29
lines changed

mkdocs.yml

Lines changed: 35 additions & 29 deletions
Original file line numberDiff line numberDiff line change
@@ -6,7 +6,7 @@ theme:
66
features:
77
- navigation.tabs
88
- navigation.top
9-
# - navigation.indexes
9+
- navigation.indexes
1010
palette:
1111
# Light mode
1212
- media: "(prefers-color-scheme: light)"
@@ -80,6 +80,40 @@ plugins:
8080
nav:
8181
- Home: index.md
8282
- Components: components.md
83+
- Hardware Setup:
84+
- hardware_setup/overview.md
85+
- 3D Printing: hardware_setup/3D_print.md
86+
- Electronics: hardware_setup/electronics.md
87+
- Assembly: hardware_setup/assembly.md
88+
- Install: hardware_setup/install.md
89+
- Processing Units:
90+
- Raspberry Pi Setup: rpi-setup.md
91+
- Jetson Nano Setup: jetson-nano-setup.md
92+
- Git Setup: git-setup.md
93+
- ROS Setup: ros-setup.md
94+
- Teensy MCU: teensy-mcu.md
95+
- Hardware Interfaces: hardware-interfaces.md
96+
- ROS Network Setup: ros-network-setup.md
97+
- ROS Software Packages:
98+
- Packages: packages.md
99+
- Robot Package: diffbot_robot.md
100+
- Robot Description:
101+
- Robot Description: robot-description.md
102+
- Remo Description: packages/remo_description.md
103+
- Simulation: diffbot_gazebo.md
104+
- Control: diffbot_control.md
105+
- Base Hardware Interface: diffbot_base.md
106+
- Messages: diffbot_msgs.md
107+
- Motor Driver: grove_motor_driver.md
108+
- Motor and Encoder: DG01D-E-motor-with-encoder.md
109+
- Navigation: diffbot_navigation.md
110+
- SLAM: diffbot_slam.md
111+
- Move Base Flex: diffbot_mbf.md
112+
- Hardware Bringup: diffbot_bringup.md
113+
- Rasperry Pi Camera: packages/raspicam_node.md
114+
- Inertial Measurement Unit:
115+
- Robot Localization: packages/imu/robot_localization.md
116+
- BNO055 Driver: packages/imu/driver-bno055.md
83117
- Robotics Theory:
84118
- theory/index.md
85119
- Preliminaries:
@@ -125,32 +159,4 @@ nav:
125159
- Motion and Odometry: theory/motion-and-odometry.md
126160
- Power Supply: power-supply.md
127161
- Laser Range Scanner: laser-range-scanner.md
128-
- Processing Units:
129-
- Raspberry Pi Setup: rpi-setup.md
130-
- Jetson Nano Setup: jetson-nano-setup.md
131-
- Git Setup: git-setup.md
132-
- ROS Setup: ros-setup.md
133-
- Teensy MCU: teensy-mcu.md
134-
- Hardware Interfaces: hardware-interfaces.md
135-
- ROS Network Setup: ros-network-setup.md
136-
- Packages:
137-
- Packages: packages.md
138-
- Robot Package: diffbot_robot.md
139-
- Robot Description:
140-
- Robot Description: robot-description.md
141-
- Remo Description: packages/remo_description.md
142-
- Simulation: diffbot_gazebo.md
143-
- Control: diffbot_control.md
144-
- Base Hardware Interface: diffbot_base.md
145-
- Messages: diffbot_msgs.md
146-
- Motor Driver: grove_motor_driver.md
147-
- Motor and Encoder: DG01D-E-motor-with-encoder.md
148-
- Navigation: diffbot_navigation.md
149-
- SLAM: diffbot_slam.md
150-
- Move Base Flex: diffbot_mbf.md
151-
- Hardware Bringup: diffbot_bringup.md
152-
- Rasperry Pi Camera: packages/raspicam_node.md
153-
- Inertial Measurement Unit:
154-
- Robot Localization: packages/imu/robot_localization.md
155-
- BNO055 Driver: packages/imu/driver-bno055.md
156162
- Insiders: insiders/index.md

0 commit comments

Comments
 (0)