Skip to content

Commit

Permalink
[#4] update mkdocs nav for hw setup
Browse files Browse the repository at this point in the history
Signed-off-by: Franz <[email protected]>
  • Loading branch information
fjp committed Sep 12, 2024
1 parent 037be41 commit 890a4d5
Showing 1 changed file with 40 additions and 33 deletions.
73 changes: 40 additions & 33 deletions mkdocs.yml
Original file line number Diff line number Diff line change
Expand Up @@ -83,6 +83,46 @@ nav:
- Getting Started:
- Technical Requirements: technical_requirements.md
- Components: components.md
- Hardware Setup:
- hardware_setup/overview.md
- 3D Printing: hardware_setup/3D_print.md
- Electronics: hardware_setup/electronics.md
- Assembly: hardware_setup/assembly.md
- Install: hardware_setup/install.md
- Processing Units:
- Single Board Computer:
- Raspberry Pi Setup: rpi-setup.md
- Jetson Nano Setup: jetson-nano-setup.md
- Git Setup: git-setup.md
- ROS Setup: ros-setup.md
- Microcontroller: packages/diffbot_base/scripts/teensy-mcu.md
- Hardware Interfaces: hardware-interfaces.md
- ROS Network Setup: ros-network-setup.md
- ROS Software Packages:
- packages/index.md
- Packages: packages.md
- Robot Package: diffbot_robot.md
- Robot Description:
- Robot Description: robot-description.md
- Remo Description: packages/remo_description.md
- Simulation: diffbot_gazebo.md
- Control: diffbot_control.md
- Base Hardware Interface:
- packages/diffbot_base/index.md
- PID Controllers: packages/diffbot_base/pid.md
- Low-Level PID Approach: packages/diffbot_base/low-level.md
- High-Level PID Approach: packages/diffbot_base/high-level.md
- Messages: diffbot_msgs.md
- Motor Driver: grove_motor_driver.md
- Motor and Encoder: DG01D-E-motor-with-encoder.md
- Navigation: diffbot_navigation.md
- SLAM: diffbot_slam.md
- Move Base Flex: diffbot_mbf.md
- Hardware Bringup: diffbot_bringup.md
- Rasperry Pi Camera: packages/raspicam_node.md
- Inertial Measurement Unit:
- Robot Localization: packages/imu/robot_localization.md
- BNO055 Driver: packages/imu/driver-bno055.md
- Robotics Theory:
- theory/index.md
- Preliminaries:
Expand Down Expand Up @@ -128,37 +168,4 @@ nav:
- Motion and Odometry: theory/motion-and-odometry.md
- Power Supply: power-supply.md
- Laser Range Scanner: laser-range-scanner.md
- Processing Units:
- Single Board Computer:
- Raspberry Pi Setup: rpi-setup.md
- Jetson Nano Setup: jetson-nano-setup.md
- Git Setup: git-setup.md
- ROS Setup: ros-setup.md
- Microcontroller: packages/diffbot_base/scripts/teensy-mcu.md
- Hardware Interfaces: hardware-interfaces.md
- ROS Network Setup: ros-network-setup.md
- Packages:
- packages/index.md
- Robot Package: diffbot_robot.md
- Robot Description:
- Robot Description: robot-description.md
- Remo Description: packages/remo_description.md
- Simulation: diffbot_gazebo.md
- Control: diffbot_control.md
- Base Hardware Interface:
- packages/diffbot_base/index.md
- PID Controllers: packages/diffbot_base/pid.md
- Low-Level PID Approach: packages/diffbot_base/low-level.md
- High-Level PID Approach: packages/diffbot_base/high-level.md
- Messages: diffbot_msgs.md
- Motor Driver: grove_motor_driver.md
- Motor and Encoder: DG01D-E-motor-with-encoder.md
- Navigation: diffbot_navigation.md
- SLAM: diffbot_slam.md
- Move Base Flex: diffbot_mbf.md
- Hardware Bringup: diffbot_bringup.md
- Rasperry Pi Camera: packages/raspicam_node.md
- Inertial Measurement Unit:
- Robot Localization: packages/imu/robot_localization.md
- BNO055 Driver: packages/imu/driver-bno055.md
- Insiders: insiders/index.md

0 comments on commit 890a4d5

Please sign in to comment.