Skip to content

Commit e65e02d

Browse files
committed
[#4] update mkdocs nav for hw setup
1 parent 3a69f8e commit e65e02d

File tree

1 file changed

+35
-29
lines changed

1 file changed

+35
-29
lines changed

mkdocs.yml

+35-29
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)"
@@ -82,6 +82,40 @@ nav:
8282
- Getting Started:
8383
- Technical Requirements: technical-requirements.md
8484
- Components: components.md
85+
- Hardware Setup:
86+
- hardware_setup/overview.md
87+
- 3D Printing: hardware_setup/3D_print.md
88+
- Electronics: hardware_setup/electronics.md
89+
- Assembly: hardware_setup/assembly.md
90+
- Install: hardware_setup/install.md
91+
- Processing Units:
92+
- Raspberry Pi Setup: rpi-setup.md
93+
- Jetson Nano Setup: jetson-nano-setup.md
94+
- Git Setup: git-setup.md
95+
- ROS Setup: ros-setup.md
96+
- Teensy MCU: teensy-mcu.md
97+
- Hardware Interfaces: hardware-interfaces.md
98+
- ROS Network Setup: ros-network-setup.md
99+
- ROS Software Packages:
100+
- Packages: packages.md
101+
- Robot Package: diffbot_robot.md
102+
- Robot Description:
103+
- Robot Description: robot-description.md
104+
- Remo Description: packages/remo_description.md
105+
- Simulation: diffbot_gazebo.md
106+
- Control: diffbot_control.md
107+
- Base Hardware Interface: diffbot_base.md
108+
- Messages: diffbot_msgs.md
109+
- Motor Driver: grove_motor_driver.md
110+
- Motor and Encoder: DG01D-E-motor-with-encoder.md
111+
- Navigation: diffbot_navigation.md
112+
- SLAM: diffbot_slam.md
113+
- Move Base Flex: diffbot_mbf.md
114+
- Hardware Bringup: diffbot_bringup.md
115+
- Rasperry Pi Camera: packages/raspicam_node.md
116+
- Inertial Measurement Unit:
117+
- Robot Localization: packages/imu/robot_localization.md
118+
- BNO055 Driver: packages/imu/driver-bno055.md
85119
- Robotics Theory:
86120
- theory/index.md
87121
- Preliminaries:
@@ -127,32 +161,4 @@ nav:
127161
- Motion and Odometry: theory/motion-and-odometry.md
128162
- Power Supply: power-supply.md
129163
- Laser Range Scanner: laser-range-scanner.md
130-
- Processing Units:
131-
- Raspberry Pi Setup: rpi-setup.md
132-
- Jetson Nano Setup: jetson-nano-setup.md
133-
- Git Setup: git-setup.md
134-
- ROS Setup: ros-setup.md
135-
- Teensy MCU: teensy-mcu.md
136-
- Hardware Interfaces: hardware-interfaces.md
137-
- ROS Network Setup: ros-network-setup.md
138-
- Packages:
139-
- Packages: packages.md
140-
- Robot Package: diffbot_robot.md
141-
- Robot Description:
142-
- Robot Description: robot-description.md
143-
- Remo Description: packages/remo_description.md
144-
- Simulation: diffbot_gazebo.md
145-
- Control: diffbot_control.md
146-
- Base Hardware Interface: diffbot_base.md
147-
- Messages: diffbot_msgs.md
148-
- Motor Driver: grove_motor_driver.md
149-
- Motor and Encoder: DG01D-E-motor-with-encoder.md
150-
- Navigation: diffbot_navigation.md
151-
- SLAM: diffbot_slam.md
152-
- Move Base Flex: diffbot_mbf.md
153-
- Hardware Bringup: diffbot_bringup.md
154-
- Rasperry Pi Camera: packages/raspicam_node.md
155-
- Inertial Measurement Unit:
156-
- Robot Localization: packages/imu/robot_localization.md
157-
- BNO055 Driver: packages/imu/driver-bno055.md
158164
- Insiders: insiders/index.md

0 commit comments

Comments
 (0)