Functions | Variables
main.cpp File Reference
#include <ros.h>
#include "diffbot_base_config.h"
#include "base_controller.h"
#include "adafruit_feather_wing/adafruit_feather_wing.h"
Include dependency graph for main.cpp:

Go to the source code of this file.

Functions

BaseController< AdafruitMotorController, Adafruit_MotorShield > base_controller (nh, &motor_controller_left, &motor_controller_right)
 
void loop ()
 
void setup ()
 

Variables

AdafruitMotorController motor_controller_left = AdafruitMotorController(MOTOR_LEFT)
 
AdafruitMotorController motor_controller_right = AdafruitMotorController(MOTOR_RIGHT)
 
ros::NodeHandle nh
 

Function Documentation

◆ base_controller()

BaseController<AdafruitMotorController, Adafruit_MotorShield> base_controller ( nh  ,
motor_controller_left,
motor_controller_right 
)

◆ loop()

void loop ( )

Definition at line 30 of file main.cpp.

◆ setup()

void setup ( )

Definition at line 18 of file main.cpp.

Variable Documentation

◆ motor_controller_left

Definition at line 13 of file main.cpp.

◆ motor_controller_right

Definition at line 12 of file main.cpp.

◆ nh

Definition at line 8 of file main.cpp.



diffbot_base
Author(s):
autogenerated on Thu Sep 7 2023 02:35:23