Difference between revisions of "S24: Team X"
(→Geographical Controller) |
(→Sensor and Bridge Controller ECU) |
||
Line 407: | Line 407: | ||
[https://gitlab.com/ashley.n.ho/sjtwo-c/-/tree/master/projects/sensor_node?ref_type=heads Gitlab Sensor and Bridge Controller Node Link] | [https://gitlab.com/ashley.n.ho/sjtwo-c/-/tree/master/projects/sensor_node?ref_type=heads Gitlab Sensor and Bridge Controller Node Link] | ||
+ | |||
+ | |||
+ | |||
+ | <syntaxhighlight lang="c"> | ||
+ | void periodic_callbacks__1Hz(uint32_t callback_count) { | ||
+ | if (callback_count == 0) { | ||
+ | delay__us(450000); // start up delay | ||
+ | return; | ||
+ | } | ||
+ | ultra_sonic_sensor_data_s data; | ||
+ | ultrasonic_sensor__run_once(); | ||
+ | } | ||
+ | </syntaxhighlight> | ||
+ | <syntaxhighlight lang="c"> | ||
+ | void periodic_callbacks__10Hz(uint32_t callback_count) { | ||
+ | sensors__transmit_once(); | ||
+ | bridge_get_data(); | ||
+ | sensor_msg_bank__handle_msg(); | ||
+ | heading_sensor_run_once(); | ||
+ | } | ||
+ | </syntaxhighlight> | ||
=== Hardware Design === | === Hardware Design === |
Revision as of 19:35, 18 May 2024
Contents
Project Title
Team X
Abstract
Our main goal of this project was to utilize the knowledge acquired from the lectures in CMPE 243. The report summarizes the overall process taken to develop an autonomous driving RC car using FreeRTOS, various periodic tasks, and the CAN bus to combine and run the different code modules.
Introduction
The project was divided into 5 modules:
- Sensor Node
- Motor Node
- Driver Node
- Geo Node
- Mobile Application
Team Members & Responsibilities
<Team Picture>
Team Members | Task Responsibility |
---|---|
|
|
|
|
|
|
|
|
Schedule
Week# | Start Date | End Date | Task | Status |
---|---|---|---|---|
1 | 02/19/2024 | 02/25/2024 |
|
|
2 | 02/26/2024 | 03/03/2024 |
|
|
3 | 03/04/2024 | 03/11/2024 |
|
|
4 | 03/18/2024 | 03/24/2024 |
|
|
5 | 03/25/2024 | 03/31/2024 |
|
|
6 | 04/01/2024 | 04/07/2024 |
|
|
7 | 04/08/2024 | 04/14/2024 |
|
|
8 | 04/15/2024 | 04/21/2024 |
|
|
9 | 04/22/2024 | 04/28/2024 |
|
|
10 | 04/29/2024 | 05/05/2024 |
|
|
11 | 05/06/2024 | 05/12/2024 |
|
|
12 | 05/06/2024 | 05/12/2024 |
|
|
13 | 05/13/2024 | 05/19/2024 |
|
|
14 | 05/20/2024 | 05/26/2024 |
|
|
Parts List & Cost
Item# | Part Desciption | Vendor | Qty | Cost |
---|---|---|---|---|
1 | RC Car | Traxxas | 1 | $250.00 |
2 | RC Car Battery | Traxxus | 2 | $110 |
3 | CAN Transceivers MCP2551-I/P | Microchip | 8 | Free Samples |
4 | MB1010 LV-MaxSonar | Ebay | 4 | $29.95 |
5 | GPS Module | Amazon | 1 | $18.99 |
6 | BMM150 Magnetometer | Amazon | 1 | $12.49 |
7 | LCD | Amazon | 1 | $11.69 |
CAN Communication
Each node is connected to a CAN transceiver that are connected to a bus with a 120 Ohm resistor on each end. We handled each message on the 10Hz, with the sensor and motor messages having the highest priority.
Specifically, we classified each node with these (see table below) message IDs.
Node | Message ID Range | |
---|---|---|
1 | MOTOR | 300 - 310 |
2 | SENSOR | 200 |
3 | GEO | 400 - 450 |
4 | DEBUG | 600 - 700 |
Hardware Design
DBC File
Shown below are the messages utilized in our DBC file:
BO_ 200 SENSOR_SONARS: 4 SENSOR SG_ SENSOR_SONARS_left : 0|10@1+ (1,0) [6|254] "inch" DRIVER SG_ SENSOR_SONARS_right : 10|10@1+ (1,0) [6|254] "inch" DRIVER SG_ SENSOR_SONARS_middle : 20|10@1+ (1,0) [6|254] "inch" DRIVER
BO_ 300 MOTOR_CMD: 1 DRIVER SG_ MOTOR_CMD_steer: 0|4@1- (1,0) [-2|2] "" MOTOR SG_ MOTOR_CMD_forward: 4|4@1- (1,0) [-5|5] "" MOTOR
BO_ 310 MOTOR_STOP: 1 SENSOR SG_ MOTOR_STOP_stop: 0|1@1+ (1,0) [0|0] "" MOTOR
BO_ 400 GPS_NAV: 2 GEO SG_ GPS_NAV_latitude : 0|8@1- (1,0) [-90|90] "" DRIVER SG_ GPS_NAV_longitude : 8|8@1- (1,0) [-180|180] "" DRIVER
BO_ 420 GPS_HEADING: 4 SENSOR SG_ GPS_HEADING_RAW_DEGREES: 0|16@1+ (1,0) [0|0] "Degrees" GEO
BO_ 430 GEO_STATUS: 4 GEO SG_ GEO_STATUS_COMPASS_HEADING : 0|5@1+ (1,0) [0|18] "Degrees" DRIVER SG_ GEO_STATUS_COMPASS_BEARING : 5|5@1+ (1,0) [0|18] "Degrees" DRIVER SG_ GEO_STATUS_DISTANCE_TO_DESTINATION : 10|16@1+ (0.1,0) [0|0] "Meters" DRIVER
BO_ 450 GPS_DESTINATION_LOCATION: 8 DRIVER SG_ GPS_DEST_LATITUDE_SCALED_100000 : 0|32@1- (1,0) [0|0] "Degrees" GEO SG_ GPS_DEST_LONGITUDE_SCALED_100000 : 32|32@1- (1,0) [0|0] "Degrees" GEO
BO_ 600 DBG_MSG_MOTOR: 4 MOTOR SG_ SPEED_M_PER_S : 0|32@1+ (0.001,-100) [0|0] "" SENSOR
BO_ 700 DBG_MSG_GPS: 3 GEO SG_ DBG_GPS_latitude : 0|8@1- (1,0) [-90|90] "" DBG SG_ DBG_GPS_longitude : 8|8@1- (1,0) [-180|180] "" DBG SG_ DBG_GPS_lock : 16|1@1+ (1,0) [0|0] "" DBG
Sensor and Bridge Controller ECU
Gitlab Sensor and Bridge Controller Node Link
void periodic_callbacks__1Hz(uint32_t callback_count) {
if (callback_count == 0) {
delay__us(450000); // start up delay
return;
}
ultra_sonic_sensor_data_s data;
ultrasonic_sensor__run_once();
}
void periodic_callbacks__10Hz(uint32_t callback_count) {
sensors__transmit_once();
bridge_get_data();
sensor_msg_bank__handle_msg();
heading_sensor_run_once();
}
Hardware Design
Software Design
Sensor Modules
void ultrasonic_sensor__run_once() {
// left, middle, right respectively
for (int i = 0; i < 8; i++) {
uint16_t adc_raw[3];
// start range and wait till all sensors are done
ultrasonic_range_once();
adc_raw[0] = adc__get_adc_value(ADC__CHANNEL_2);
adc_raw[1] = adc__get_adc_value(ADC__CHANNEL_4);
adc_raw[2] = adc__get_adc_value(ADC__CHANNEL_5);
// printf("adc2: %d\n", adc_raw[0]);
sensor_data.left = ((float)adc_raw[0] * SCALE_FACTOR); // / 2.0;
sensor_data.middle = ((float)adc_raw[1] * SCALE_FACTOR); // / 2.0;
sensor_data.right = ((float)adc_raw[2] * SCALE_FACTOR); // / 2.0;
if (sensor_data.left < 36) {
gpio__reset(board_io__get_led3());
} else {
gpio__set(board_io__get_led3());
}
if (sensor_data.middle < 36) {
gpio__reset(board_io__get_led2());
} else {
gpio__set(board_io__get_led2());
}
if (sensor_data.right < 36) {
gpio__reset(board_io__get_led1());
} else {
gpio__set(board_io__get_led1());
}
}
}
Bridge Controller
void bridge_get_data(void) {
char byte;
const uint32_t zero_timeout = 0;
while (uart__get(bridge_uart, &byte, zero_timeout)) {
printf("received byte: %c\n", byte);
}
}
void bridge_send_data(void *buf, uint8_t buf_size, uint8_t msg_id) {
// Format the float value from the buffer
char tx_buf[30];
if (msg_id == 0) {
float speed = *(float *)buf;
snprintf(tx_buf, sizeof(tx_buf), "spd: %f\n", (double)speed);
} else if (msg_id == 1) {
dbc_GEO_STATUS_s *msg = (dbc_GEO_STATUS_s *)buf;
snprintf(tx_buf, sizeof(tx_buf), "hd: %d, br: %d\n", msg->GEO_STATUS_COMPASS_HEADING,
msg->GEO_STATUS_COMPASS_BEARING);
}
uart_printf(bridge_uart, "%s", tx_buf);
// printf("sent: %s\n", tx_buf);
}
static void process_uart_data_buf(void) {
int temp;
char *token;
int coord_received = 0;
token = strtok(uart_rx_buf, ",");
temp = atoi(token);
if (temp != 0) {
dest_latitude = temp / 1000000.0f;
printf("la: %f ", (double)dest_latitude);
coord_received++;
}
token = strtok(NULL, ",");
temp = atoi(token);
if (temp != 0) {
dest_longitude = temp / 1000000.0f;
printf("lo: %f\n", (double)dest_longitude);
coord_received++;
}
if (coord_received == 2) {
dbc_GPS_DESTINATION_LOCATION_s dest_location;
dest_location.GPS_DEST_LATITUDE_SCALED_100000 = dest_latitude * 100000;
dest_location.GPS_DEST_LONGITUDE_SCALED_100000 = dest_longitude * 100000;
can__msg_t can_msg = {};
dbc_message_header_t header;
header = dbc_encode_GPS_DESTINATION_LOCATION(can_msg.data.bytes, &dest_location);
can_msg.msg_id = header.message_id;
can_msg.frame_fields.data_len = header.message_dlc;
can__tx(can1, &can_msg, 0);
}
}
Technical Challenges
Our main problems with the sensors occurred once we began outdoor testing. When testing indoors, we encountered no issues with the sensors incorrectly detecting obstacles. However, when moving outdoors, the sensors would detect the ground; thus, we resolved the issue by re-mounting the sensors at an angle in order to avoid detecting the ground. Additionally, we found that when initially calibrating the sensors on startup, there must not be any objects in its way for proper calibration, otherwise we would run into undefined behavior.
Motor ECU
The motor node utilized the 10Hz to handle message transmission and reception as well as for setting the PWM value. Meanwhile, the 100Hz periodics processed the inputs and transferred the data received to their respective local data structures (see Software Design for more details).
void periodic_callbacks__10Hz(uint32_t callback_count) {
motor_msg_bank__handle_msg();
motor_msg_bank__service_mia_10hz();
motor_pwm__set_pwm();
if (callback_count % 7 == 0) {
motor_rpm_driver_calc_speed();
}
motor_speed_pid_run_once();
}
void periodic_callbacks__100Hz(uint32_t callback_count) {
motor_pwm__process_input();
}
Hardware Design
The motor is directly connected to the RC car's ESC device, which is what initially controlled the car's PWMs prior to hijacking. The SJ2 now becomes the PWM transmitter as opposed to the remote and sends the corresponding PWMs based on driver signals (see Software Design for more details)
Software Design
The motor software takes in driver-motor commands through the CAN bus and based on those commands, modifies the PWMs of the motor and the servo to move the wheels forward, backward, left, or right. We mapped the PWM values (See tables below).
Motor PWM | Direction | |
---|---|---|
1 | 16.2 | Forward |
2 | 14.5 | Backward |
3 | 15.02 | Idle |
Servo PWM | Direction | |
---|---|---|
1 | 11.0 | Hard Left |
2 | 13.0 | Slight Left |
3 | 15.48 | Straight |
4 | 17.0 | Slight Right |
5 | 19.0 | Hard Right |
Additionally, we utilized a general state machine that allowed for fluid transitions between forward and reverse (see diagram below). Without a delay in a neutral state, the car's motor would not be able to easily transition from forward to reverse and vice versa, but would rather just stop. As such, we implemented the diagram in the code below and thus allowed for the car to easily transition between the states of forward and reverse.
void motor_pwm__set_pwm(void) {
motor_pwm__set_motor_pwm();
motor_pwm__set_servo_pwm();
}
static void motor_pwm__set_servo_pwm(void) {
static float set_servo_duty_cycle = servo_pwm_idle_duty_cycle;
if (motor_cmd_local.MOTOR_CMD_steer == 0) {
// idle
set_servo_duty_cycle = servo_pwm_idle_duty_cycle;
} else if (motor_cmd_local.MOTOR_CMD_steer == 1) {
// slightly right
set_servo_duty_cycle = 17.00;
} else if (motor_cmd_local.MOTOR_CMD_steer == 2) {
// max right
set_servo_duty_cycle = 19.00;
} else if (motor_cmd_local.MOTOR_CMD_steer == -1) {
// slightly left
set_servo_duty_cycle = 13.00;
} else if (motor_cmd_local.MOTOR_CMD_steer == -2) {
// max left
set_servo_duty_cycle = 11.00;
}
pwm1__set_duty_cycle(servo_pwm, set_servo_duty_cycle);
}
static void motor_pwm__set_motor_pwm(void) {
static float set_motor_duty_cycle = motor_pwm_idle_duty_cycle;
if (motor_stop_local.MOTOR_STOP_stop) {
motor_speed_pid_set_target_pwm(motor_pwm_idle_duty_cycle);
} else {
if (!ignore_cmds) {
if (motor_cmd_local.MOTOR_CMD_forward == -1) { // Reverse
set_motor_duty_cycle = 14.50;
if (reverse_flag == false) {
motor_speed_pid_set_target_pwm(motor_pwm_idle_duty_cycle);
ignore_cmds = true;
start_time = sys_time__get_uptime_ms();
reverse_flag = true;
return;
}
} else if (motor_cmd_local.MOTOR_CMD_forward == 0) { // Stop
set_motor_duty_cycle = motor_pwm_idle_duty_cycle;
} else if (motor_cmd_local.MOTOR_CMD_forward == 3) { // Forward
set_motor_duty_cycle = 16.2; // 15.7 originally?, 16.2
if (reverse_flag == true) {
motor_speed_pid_set_target_pwm(motor_pwm_idle_duty_cycle);
ignore_cmds = true;
start_time = sys_time__get_uptime_ms();
reverse_flag = false;
return;
}
}
motor_speed_pid_set_target_pwm(set_motor_duty_cycle);
} else if (sys_time__get_uptime_ms() - start_time >= DIRECTION_CHANGE_DELAY) {
ignore_cmds = false;
} else {
}
}
}
Technical Challenges
The main issue we had with the motor controller occurred during PWM hacking because we did not want the motor running the car too fast. As such, we had to guess and check a good PWM value to run the motor so that the car would move at the slowest speed possible without running into issues where it could not move. However, with continual tests, we managed to identify the ideal range we wanted to run the motor.
Additionally, we encountered minor issues where, when transitioning from reverse to forward and vice versa, the car would go into neutral and never exit from the neutral state. We found that this issue occurred due to the delay being too small, and so the motor would not have enough time to truly go into neutral and thus would remain in that state. To counter this, we increased the delay and also slightly increased the forward PWM in order to combat the potential that it was stopping due to having too low of a PWM value.
Geographical Controller
The Geo node utilized the 10Hz to handle message transmission and reception as well as receiving the compass and GPS data directly from the hardware modules. Meanwhile, the 100Hz periodics processed the inputs and transferred the data received to their respective local data structures (see Software Design for more details).
void periodic_callbacks__1Hz(uint32_t callback_count) {
int gps_lock_status = geo_sensors_gps__get_gps_lock_status();
// printf("GPS lock status: %d\n", gps_lock_status);
if (!gps_lock_status) {
gpio__toggle(board_io__get_led0());
} else {
gpio__reset(board_io__get_led0());
}
}
void periodic_callbacks__10Hz(uint32_t callback_count) {
geo_msg_bank__handle_msg();
geo_msg_bank__service_mia_10hz();
geo_msg_bank__transmit_msg();
geo_sensors_gps__run_once();
// geo_sensors_compass_lsm__run_once();
}
Hardware Design
Software Design
GPS
bool geo_sensors_gps__run_once(void) {
bool gps_transfer_success = false;
gps_transfer_success = geo_sensors_gps__transfer_data_from_uart_driver_to_line_buffer();
gps__parse_coordinates_from_line();
return gps_transfer_success;
}
bool geo_sensors_gps__transfer_data_from_uart_driver_to_line_buffer(void) {
char byte_read;
const uint32_t zero_timeout = 0;
bool gps_status_reading = false;
while (uart__get(uart_gps, &byte_read, zero_timeout)) {
gps_status_reading = true;
line_buffer__add_byte(&line, byte_read);
}
return gps_status_reading;
}
static void gps__parse_coordinates_from_line(void) {
char gps_line[1000];
if (line_buffer__remove_line(&line, gps_line, sizeof(gps_line))) {
// Check if the line is a GPGGA stream
if (strncmp(gps_line, "$GPGGA,", 7) == 0) {
char *token;
int field_idx = 0;
int latitude_flag = 1;
int longitude_flag = 1;
float latitude = 0.0;
float longitude = 0.0;
token = strtok(gps_line, ",");
while (token != NULL) {
token = strtok(NULL, ",");
field_idx++;
if (field_idx == 2) { // Latitude is field 2 in GPGGA
latitude = atof(token);
} else if (field_idx == 3) { // N/S direction is field 3 in GPGGA
char c = token[0];
if (c == 'S') {
latitude_flag *= -1;
}
} else if (field_idx == 4) { // Longitude is field 4 in GPGGA
longitude = atof(token);
} else if (field_idx == 5) { // E/W direction is field 5 in GPGGA
char c = token[0];
if (c == 'W') {
longitude_flag *= -1;
}
} else if (field_idx == 6) {
char c = token[0];
// printf("GPS QUALITY: %c\n", c);
if (c == '0') {
gps_quality = 0;
} else if (c == '1') {
gps_quality = 1;
// printf("GPS lock successful\n");
} else {
// printf("Trying to acquire GPS fix\n");
}
} else if (field_idx > 6) {
break;
}
}
int latitude_days = latitude / 100;
int longitude_days = longitude / 100;
float latitude_minutes = latitude - 3700.00;
float longitude_minutes = longitude - 12100.00;
latitude_minutes /= 60;
longitude_minutes /= 60;
parsed_coordinates.latitude = ((1.0 * latitude_days) + latitude_minutes) * latitude_flag;
parsed_coordinates.longitude = ((1.0 * longitude_days) + longitude_minutes) * longitude_flag;
}
}
Compass Module
void geo_sensors_compass_lsm__run_once(void) { geo_sensors_compass__read(); }
void geo_sensors_compass__read(void) {
uint8_t buffer[6];
float mag[3];
i2c__read_slave_data(current_i2c, magnetometer_read, LSM303AGR_MAG_OUTX_L_REG, buffer, 6);
mag[0] = (int16_t)(buffer[1] << 8 | buffer[0]);
mag[1] = (int16_t)(buffer[3] << 8 | buffer[2]);
mag[2] = (int16_t)(buffer[5] << 8 | buffer[4]);
geo_sensors_compass__calculate_heading(mag);
}
static void geo_sensors_compass__calculate_heading(float mag[3]) {
float magnitude = sqrtf(mag[0] * mag[0] + mag[1] * mag[1] + mag[2] * mag[2]);
const float epsilon = 1e-6;
if (magnitude < epsilon) {
current_compass_heading = 0;
} else {
float mag_xy = mag[1] / magnitude;
float mag_xx = mag[0] / magnitude;
current_compass_heading = (atan2(mag_xy, mag_xx)) * 180.0 / PI;
if (current_compass_heading < 0) {
current_compass_heading = 360 + current_compass_heading;
}
}
}
Haversine Algorithm
void geo_logic__haversine_calculation(void) {
// Input: Latitude longitude, Output: heading, bearing, distance to destination
gps_coordinates_t current_gps = geo_sensors_gps__get_coordinates();
float current_latitude = current_gps.latitude;
float current_longitude = current_gps.longitude;
gps_coordinates_t destination_gps = geo_msg_bank__get_gps_destination_location();
float destination_latitude = destination_gps.latitude;
float destination_longitude = destination_gps.longitude;
// Convert latitudes and longitudes from degrees to radians
float phi1 = (float)(current_latitude * (float)PI_VAL / (float)180.0);
float phi2 = (float)(destination_latitude * PI_VAL / (float)180.0);
float delta_phi = (float)(destination_latitude - current_latitude) * PI_VAL / (float)180.0;
float delta_lambda = (float)(destination_longitude - current_longitude) * PI_VAL / (float)180.0;
// Haversine formula
float a =
sin(delta_phi / 2) * sin(delta_phi / 2) + cos(phi1) * cos(phi2) * sin(delta_lambda / 2) * sin(delta_lambda / 2);
float c = 2 * atan2(sqrt(a), sqrt(1 - a));
distance_to_destination = RADIUS_EARTH_KM * c * 1000;
// Bearing calculation
float y = sin(delta_lambda) * cos(phi2);
float x = cos(phi1) * sin(phi2) - sin(phi1) * cos(phi2) * cos(delta_lambda);
float bearing_rad = atan2(y, x);
compass_bearing = fmod((bearing_rad * (float)180.0 / (float)PI_VAL + (float)360.0), 360.0);
compass_heading = geo_msg_bank__get_heading();
current_geo_status.GEO_STATUS_DISTANCE_TO_DESTINATION = distance_to_destination;
current_geo_status.GEO_STATUS_COMPASS_BEARING = (uint8_t)(compass_bearing / 20);
current_geo_status.GEO_STATUS_COMPASS_HEADING = (uint8_t)(compass_heading);
}
Technical Challenges
Most of our problems occurred due to an inaccurate compass reading. Mainly, the compass heading angles would not return as very stable values, which resulted in unstable driving behavior for the car. We initially thought it would resolve itself with some software calibration; however, we found that even with software calibration for the LSM, it would still be inaccurate and would not even give the full 360 degree heading range. As such, we resolved to simply buying a more expensive and more accurate magnetometer, which solved our issues. The new module returned more stable values, despite it still fluctuating, the angle changing was not enough to affect the driving behavior since we built our module with the intent of not needing the exact degree of the angles. We also found some trouble mounting the compass due to not wanting to have to handle any further offsets after mounting. Because of this, when mounting the compass, we identified where the compass was detecting north and faced the front of the car in that direction. Following that step, we mounted the compass so that it, along with the front of the car, was facing north.
Additionally, we ran into some errors with the GPS module due to us receiving latitude and longitude values that were miles away from our current location. However, we identified an error on our end where we had misinterpreted the data returned from the GPS module and thus were calculating the wrong latitude and longitude values. Once we identified the error, we found the correct way to extract the correct latitude and longitude values for a more accurate location.
Driver and LCD Module
The driver node utilized the 10Hz to handle message transmission and reception as well as setting the LCD display for status updates and motor commands. Meanwhile, the 100Hz periodics processed the inputs and transferred the data received to their respective local data structures (see Software Design for more details).
void periodic_callbacks__10Hz(uint32_t callback_count) {
driver_msg_bank__handle_msg();
driver_msg_bank__service_mia_10hz();
driver_msg_bank__transmit_msg();
i2c_lcd__clear();
driver__lcd_display_data();
}
void periodic_callbacks__100Hz(uint32_t callback_count) {
driver__process_input();
}
Hardware Design
The driver node, aside from its connection to the CAN bus, is also connected the the LCD module through I2C. the SJ2 board provides the LCD with 3.3V power and sends data through SDA and SCL.
Software Design
Driver Logic
The driver logic came down to a basic logic (shown in table below) where 0 implies there is no obstacle, and 1 implies an obstacle is present. Depending on each combination of 1's and 0's, the car would determine whether to turn left or right and move forward or backward.
dbc_MOTOR_CMD_s driver__get_motor_commands(void) {
driver__avoid_obstacle();
return motor_commands;}
static void driver__avoid_obstacle(void) {
obstacle_below_threshold_s below_thresholds = driver__closest_obstacle();
if (!(below_thresholds.MIDDLE) && !(below_thresholds.LEFT) && !(below_thresholds.RIGHT)) {
driver__go_to_destination();
} else {
driver__steering();
}
driver__led_indicators();}
dbc_MOTOR_CMD_s driver__get_motor_commands(void) {
driver__avoid_obstacle();
return motor_commands;
}
// slight turns for destination movement
static void driver__go_to_destination(void) {
int angle_difference = local_geo_status.GEO_STATUS_COMPASS_HEADING - local_geo_status.GEO_STATUS_COMPASS_BEARING;
if (local_geo_status.GEO_STATUS_DISTANCE_TO_DESTINATION > 0) {
if (angle_difference > 0) {
// go right
motor_commands.MOTOR_CMD_steer = 1;
motor_commands.MOTOR_CMD_forward = 3;
} else if (angle_difference < 0) {
// go left
motor_commands.MOTOR_CMD_steer = -1;
motor_commands.MOTOR_CMD_forward = 3;
} else { // go straight
motor_commands.MOTOR_CMD_steer = 0;
motor_commands.MOTOR_CMD_forward = 3;
}
} else { // reached destination
motor_commands.MOTOR_CMD_forward = 0;
motor_commands.MOTOR_CMD_steer = 0;
}}
LCD Logic
The LCD printout relied solely on the datasheet. However, some optimizations were made in order to simplify the LCD methods. Specifically the starting_position() function allowed for eash access to each line of the LCD's printout without needing to write data to the addresses every time we wanted to print onto a specific line. Additionally, the lcd__printf() was a minor optimization to allow for us to print a string rather than per character and calling the send_data() function for every character.
void driver__lcd_display_data(void) {
char debug_str[15];
if (local_motor_stop.MOTOR_STOP_stop) {
i2c_lcd__clear();
i2c_lcd__starting_position(0, 0);
i2c_lcd__printf(" MOTOR STOPPED!");
i2c_lcd__starting_position(1, 0);
i2c_lcd__printf(" PLS RESTART BRIDGE");
i2c_lcd__starting_position(1, 0);
i2c_lcd__printf(" TO CONTINUE");
} else if (local_geo_status.GEO_STATUS_DISTANCE_TO_DESTINATION) {
sprintf(debug_str, "%.1lf", local_geo_status.GEO_STATUS_DISTANCE_TO_DESTINATION);
i2c_lcd__starting_position(0, 0);
i2c_lcd__printf(" PROJECT TEAM X");
i2c_lcd__starting_position(1, 0);
i2c_lcd__printf("Distance:");
i2c_lcd__starting_position(1, 10);
i2c_lcd__printf(debug_str);
sprintf(debug_str, "%d", (int)local_geo_status.GEO_STATUS_COMPASS_HEADING);
i2c_lcd__starting_position(2, 0);
i2c_lcd__printf(" Heading:");
i2c_lcd__starting_position(2, 13);
i2c_lcd__printf(debug_str);
sprintf(debug_str, "%d", (int)local_geo_status.GEO_STATUS_COMPASS_BEARING);
i2c_lcd__starting_position(3, 0);
i2c_lcd__printf(" Bearing:");
i2c_lcd__starting_position(3, 13);
i2c_lcd__printf(debug_str);
} else if (local_geo_status.GEO_STATUS_DISTANCE_TO_DESTINATION < 2) {
i2c_lcd__clear();
i2c_lcd__starting_position(1, 0);
i2c_lcd__printf("DESTINATION REACHED!");
}
}
void i2c_lcd__printf(char *line) {
while (*line)
i2c_lcd__send_data(*line++);
}
void i2c_lcd__starting_position(uint8_t y, uint8_t x) {
char Starting_Addr = 0x80;
switch (y) {
case 0:
Starting_Addr |= 0x00;
break;
case 1:
Starting_Addr |= 0x40;
break;
case 2:
Starting_Addr |= 0x14;
break;
case 3:
Starting_Addr |= 0x54;
break;
default:;
}
Starting_Addr += x;
i2c_lcd__send_command(0x80 | Starting_Addr);
}
Technical Challenges
Most of the issues surrounding the driver node occurred after field testing. We found there were some issues regarding how soon the driver made the decision compared to when it received the sensor data. As such, we made adjustments so that, despite the delay, there would be time for the driver to receive the sensor data, identify the correct action to take, and then move the wheels. Overall, our driver node worked as expected once we started field testing due to the multitude of unit tests that were done to ensure proper logic. We also identified some minor issues when testing the reverse; however, this was easily fixed by modifying the sensor priorities so that the middle sensor's values, when below the threshold, had the most precedence. In this way, the car would not fluctuate between going forward and reverse when there was clearly an object in front of it.
Additionally, we ran into issues integrating the LCD screen through I2C. The screen's slave address would not get detected, despite the device having the proper connections and power supply. However, it was found to have just been a hardware issue and worked with a different I2C LCD device.
Mobile Application
<Picture>
Software Design
<List the code modules that are being called periodically.>
Technical Challenges
< List of problems and their detailed resolutions>
Conclusion
Overall, through the course of this project, we learned a lot of different types of skills. Starting with the obvious, we learned better coding habits such as code modularization and code decoupling. We also understood how to utilize the CAN bus and messages in addition to PWM hacking for the RC car. In the scope of the project, we learned communication and group coordination and distribution skills. Although we had a bit of a rough start, as the project continued, we better understood how to organize weekly goals and tasks that needed to be done and properly distributed these tasks to each member. In addition, we learned how to collaborate with each other to build the RC car.
Project Video
Project Source Code
Advice for Future Students
- Start early! Order things as soon as you have your team, and keep track of finances for reimbursements
- Unit-testing lets you know the obstacle avoidance works the way you generally want it to and saves a lot of time when field testing
- Try to keep the logic simple, over-complicating the code modules makes your debugging time a lot harder since you won't know where things went wrong
Acknowledgement
Thank you Preet for the class and for guiding us through the process of building the RC car.
References
1. LCD Datasheet
2. LCD Display Initialization and Configuration Example Tutorial