2011-11-16 21:49:56 -04:00
|
|
|
/*
|
|
|
|
SITL handling
|
|
|
|
|
|
|
|
This simulates the APM1 hardware sufficiently for the APM code to
|
|
|
|
think it is running on real hardware
|
|
|
|
|
|
|
|
Andrew Tridgell November 2011
|
|
|
|
*/
|
|
|
|
#include <unistd.h>
|
|
|
|
#include <stdio.h>
|
|
|
|
#include <stdlib.h>
|
|
|
|
#include <string.h>
|
|
|
|
#include <errno.h>
|
|
|
|
#include <sys/ioctl.h>
|
|
|
|
#include <sys/types.h>
|
|
|
|
#include <sys/socket.h>
|
|
|
|
#include <netinet/in.h>
|
|
|
|
#include <netinet/udp.h>
|
|
|
|
#include <arpa/inet.h>
|
|
|
|
#include <time.h>
|
|
|
|
#include <sys/time.h>
|
|
|
|
#include <signal.h>
|
|
|
|
#include <math.h>
|
|
|
|
#include <APM_RC.h>
|
|
|
|
#include <wiring.h>
|
|
|
|
#include <AP_PeriodicProcess.h>
|
|
|
|
#include <AP_TimerProcess.h>
|
2012-06-29 02:06:28 -03:00
|
|
|
#include <SITL.h>
|
2012-03-04 05:37:10 -04:00
|
|
|
#include <avr/interrupt.h>
|
2011-11-16 21:49:56 -04:00
|
|
|
#include "sitl_adc.h"
|
|
|
|
#include "sitl_rc.h"
|
|
|
|
#include "desktop.h"
|
|
|
|
#include "util.h"
|
|
|
|
|
2011-12-02 07:45:48 -04:00
|
|
|
#define SIMIN_PORT 5501
|
|
|
|
#define RCOUT_PORT 5502
|
2011-11-16 21:49:56 -04:00
|
|
|
|
|
|
|
static int sitl_fd;
|
2011-12-02 07:45:48 -04:00
|
|
|
struct sockaddr_in rcout_addr;
|
2012-03-05 06:04:26 -04:00
|
|
|
#ifndef __CYGWIN__
|
2011-11-16 21:49:56 -04:00
|
|
|
static pid_t parent_pid;
|
2012-03-05 06:04:26 -04:00
|
|
|
#endif
|
2011-11-16 21:49:56 -04:00
|
|
|
struct ADC_UDR2 UDR2;
|
|
|
|
struct RC_ICR4 ICR4;
|
|
|
|
extern AP_TimerProcess timer_scheduler;
|
|
|
|
extern Arduino_Mega_ISR_Registry isr_registry;
|
2012-06-29 02:06:28 -03:00
|
|
|
extern SITL sitl;
|
2011-11-28 01:01:23 -04:00
|
|
|
|
2011-12-02 07:45:48 -04:00
|
|
|
static uint32_t update_count;
|
2011-11-16 21:49:56 -04:00
|
|
|
|
|
|
|
|
|
|
|
/*
|
2011-12-02 07:45:48 -04:00
|
|
|
setup a SITL FDM listening UDP port
|
2011-11-16 21:49:56 -04:00
|
|
|
*/
|
2011-12-02 07:45:48 -04:00
|
|
|
static void setup_fdm(void)
|
2011-11-16 21:49:56 -04:00
|
|
|
{
|
|
|
|
int one=1, ret;
|
|
|
|
struct sockaddr_in sockaddr;
|
|
|
|
|
|
|
|
memset(&sockaddr,0,sizeof(sockaddr));
|
|
|
|
|
|
|
|
#ifdef HAVE_SOCK_SIN_LEN
|
|
|
|
sockaddr.sin_len = sizeof(sockaddr);
|
|
|
|
#endif
|
2011-12-02 07:45:48 -04:00
|
|
|
sockaddr.sin_port = htons(SIMIN_PORT);
|
2011-11-16 21:49:56 -04:00
|
|
|
sockaddr.sin_family = AF_INET;
|
|
|
|
|
|
|
|
sitl_fd = socket(AF_INET, SOCK_DGRAM, 0);
|
|
|
|
if (sitl_fd == -1) {
|
|
|
|
fprintf(stderr, "SITL: socket failed - %s\n", strerror(errno));
|
|
|
|
exit(1);
|
|
|
|
}
|
|
|
|
|
|
|
|
/* we want to be able to re-use ports quickly */
|
|
|
|
setsockopt(sitl_fd, SOL_SOCKET, SO_REUSEADDR, &one, sizeof(one));
|
|
|
|
|
|
|
|
ret = bind(sitl_fd, (struct sockaddr *)&sockaddr, sizeof(sockaddr));
|
|
|
|
if (ret == -1) {
|
|
|
|
fprintf(stderr, "SITL: bind failed on port %u - %s\n",
|
|
|
|
(unsigned)ntohs(sockaddr.sin_port), strerror(errno));
|
|
|
|
exit(1);
|
|
|
|
}
|
|
|
|
|
|
|
|
set_nonblocking(sitl_fd);
|
|
|
|
}
|
|
|
|
|
|
|
|
/*
|
2011-12-02 07:45:48 -04:00
|
|
|
check for a SITL FDM packet
|
2011-11-16 21:49:56 -04:00
|
|
|
*/
|
2011-12-02 07:45:48 -04:00
|
|
|
static void sitl_fdm_input(void)
|
2011-11-16 21:49:56 -04:00
|
|
|
{
|
|
|
|
ssize_t size;
|
|
|
|
struct pwm_packet {
|
|
|
|
uint16_t pwm[8];
|
|
|
|
};
|
|
|
|
union {
|
2011-12-02 07:45:48 -04:00
|
|
|
struct sitl_fdm fg_pkt;
|
2011-11-16 21:49:56 -04:00
|
|
|
struct pwm_packet pwm_pkt;
|
|
|
|
} d;
|
|
|
|
|
|
|
|
size = recv(sitl_fd, &d, sizeof(d), MSG_DONTWAIT);
|
|
|
|
switch (size) {
|
|
|
|
case 132:
|
|
|
|
static uint32_t last_report;
|
|
|
|
static uint32_t count;
|
|
|
|
|
2011-12-02 07:12:58 -04:00
|
|
|
if (d.fg_pkt.magic != 0x4c56414e) {
|
|
|
|
printf("Bad FDM packet - magic=0x%08x\n", d.fg_pkt.magic);
|
2011-11-16 21:49:56 -04:00
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
|
|
|
if (d.fg_pkt.latitude == 0 ||
|
|
|
|
d.fg_pkt.longitude == 0 ||
|
|
|
|
d.fg_pkt.altitude <= 0) {
|
|
|
|
// garbage input
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
2012-06-29 02:06:28 -03:00
|
|
|
sitl.state = d.fg_pkt;
|
2011-12-02 07:45:48 -04:00
|
|
|
update_count++;
|
2011-11-28 01:01:23 -04:00
|
|
|
|
2011-11-16 21:49:56 -04:00
|
|
|
count++;
|
|
|
|
if (millis() - last_report > 1000) {
|
2012-01-10 00:23:37 -04:00
|
|
|
//printf("SIM %u FPS\n", count);
|
2011-11-16 21:49:56 -04:00
|
|
|
count = 0;
|
|
|
|
last_report = millis();
|
|
|
|
}
|
|
|
|
break;
|
|
|
|
|
|
|
|
case 16: {
|
|
|
|
// a packet giving the receiver PWM inputs
|
|
|
|
uint8_t i;
|
|
|
|
for (i=0; i<8; i++) {
|
|
|
|
// setup the ICR4 register for the RC channel
|
|
|
|
// inputs
|
|
|
|
if (d.pwm_pkt.pwm[i] != 0) {
|
|
|
|
ICR4.set(i, d.pwm_pkt.pwm[i]);
|
|
|
|
}
|
|
|
|
}
|
|
|
|
break;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
|
|
|
}
|
|
|
|
|
2012-02-27 04:29:45 -04:00
|
|
|
// used for noise generation in the ADC code
|
2012-02-27 06:58:58 -04:00
|
|
|
// motor speed in revolutions per second
|
|
|
|
float sitl_motor_speed[4] = {0,0,0,0};
|
2012-02-27 04:29:45 -04:00
|
|
|
|
2011-11-16 21:49:56 -04:00
|
|
|
/*
|
2012-02-27 04:29:45 -04:00
|
|
|
send RC outputs to simulator
|
2011-11-16 21:49:56 -04:00
|
|
|
*/
|
|
|
|
static void sitl_simulator_output(void)
|
|
|
|
{
|
|
|
|
static uint32_t last_update;
|
2011-12-02 07:45:48 -04:00
|
|
|
uint16_t pwm[11];
|
2011-11-16 21:49:56 -04:00
|
|
|
/* this maps the registers used for PWM outputs. The RC
|
|
|
|
* driver updates these whenever it wants the channel output
|
|
|
|
* to change */
|
|
|
|
uint16_t *reg[11] = { &OCR5B, &OCR5C, &OCR1B, &OCR1C,
|
|
|
|
&OCR4C, &OCR4B, &OCR3C, &OCR3B,
|
|
|
|
&OCR5A, &OCR1A, &OCR3A };
|
|
|
|
uint8_t i;
|
|
|
|
|
|
|
|
if (last_update == 0) {
|
2011-12-02 07:45:48 -04:00
|
|
|
for (i=0; i<11; i++) {
|
|
|
|
(*reg[i]) = 1000*2;
|
|
|
|
}
|
|
|
|
if (!desktop_state.quadcopter) {
|
2011-11-25 23:47:06 -04:00
|
|
|
(*reg[0]) = (*reg[1]) = (*reg[3]) = 1500*2;
|
2011-12-02 07:45:48 -04:00
|
|
|
(*reg[7]) = 1800*2;
|
2011-11-25 23:47:06 -04:00
|
|
|
}
|
2011-11-16 21:49:56 -04:00
|
|
|
}
|
|
|
|
|
2011-11-25 23:47:06 -04:00
|
|
|
// output at chosen framerate
|
|
|
|
if (millis() - last_update < 1000/desktop_state.framerate) {
|
2011-11-16 21:49:56 -04:00
|
|
|
return;
|
|
|
|
}
|
|
|
|
last_update = millis();
|
|
|
|
|
2011-12-02 07:45:48 -04:00
|
|
|
for (i=0; i<11; i++) {
|
2012-03-07 02:20:29 -04:00
|
|
|
if (*reg[i] == 0xFFFF) {
|
|
|
|
pwm[i] = 0;
|
|
|
|
} else {
|
|
|
|
pwm[i] = (*reg[i])/2;
|
|
|
|
}
|
2011-11-16 21:49:56 -04:00
|
|
|
}
|
2012-02-27 04:29:45 -04:00
|
|
|
|
2012-02-27 06:58:58 -04:00
|
|
|
if (!desktop_state.quadcopter) {
|
|
|
|
// 400kV motor, 16V
|
|
|
|
sitl_motor_speed[0] = ((pwm[2]-1000)/1000.0) * 400 * 16 / 60.0;
|
|
|
|
} else {
|
|
|
|
// 850kV motor, 16V
|
|
|
|
for (i=0; i<4; i++) {
|
|
|
|
sitl_motor_speed[i] = ((pwm[i]-1000)/1000.0) * 850 * 12 / 60.0;
|
|
|
|
}
|
|
|
|
}
|
2012-02-27 04:29:45 -04:00
|
|
|
|
2011-12-02 07:45:48 -04:00
|
|
|
sendto(sitl_fd, (void*)pwm, sizeof(pwm), MSG_DONTWAIT, (const sockaddr *)&rcout_addr, sizeof(rcout_addr));
|
2011-11-16 21:49:56 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
/*
|
|
|
|
timer called at 1kHz
|
|
|
|
*/
|
|
|
|
static void timer_handler(int signum)
|
|
|
|
{
|
2011-11-28 01:01:23 -04:00
|
|
|
static uint32_t last_update_count;
|
2012-03-28 06:46:49 -03:00
|
|
|
static bool running;
|
2011-11-28 01:01:23 -04:00
|
|
|
|
2012-03-28 06:46:49 -03:00
|
|
|
if (running) {
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
running = true;
|
2012-03-05 06:00:22 -04:00
|
|
|
cli();
|
|
|
|
|
2012-03-05 06:04:26 -04:00
|
|
|
#ifndef __CYGWIN__
|
2011-11-16 21:49:56 -04:00
|
|
|
/* make sure we die if our parent dies */
|
|
|
|
if (kill(parent_pid, 0) != 0) {
|
|
|
|
exit(1);
|
|
|
|
}
|
2012-03-14 21:16:50 -03:00
|
|
|
#else
|
|
|
|
|
|
|
|
static uint16_t count = 0;
|
|
|
|
static uint32_t last_report;
|
|
|
|
|
|
|
|
count++;
|
|
|
|
if (millis() - last_report > 1000) {
|
|
|
|
printf("TH %u cps\n", count);
|
|
|
|
count = 0;
|
|
|
|
last_report = millis();
|
|
|
|
}
|
2012-03-05 06:04:26 -04:00
|
|
|
#endif
|
2011-11-16 21:49:56 -04:00
|
|
|
|
|
|
|
/* check for packet from flight sim */
|
2011-12-02 07:45:48 -04:00
|
|
|
sitl_fdm_input();
|
2011-11-16 21:49:56 -04:00
|
|
|
|
|
|
|
// trigger all timers
|
|
|
|
timer_scheduler.run();
|
|
|
|
|
|
|
|
// trigger RC input
|
|
|
|
if (isr_registry._registry[ISR_REGISTRY_TIMER4_CAPT]) {
|
|
|
|
isr_registry._registry[ISR_REGISTRY_TIMER4_CAPT]();
|
|
|
|
}
|
|
|
|
|
|
|
|
// send RC output to flight sim
|
|
|
|
sitl_simulator_output();
|
2011-11-25 23:47:06 -04:00
|
|
|
|
2011-12-02 07:45:48 -04:00
|
|
|
if (update_count == 0) {
|
2011-11-25 23:47:06 -04:00
|
|
|
sitl_update_gps(0, 0, 0, 0, 0, false);
|
2012-03-05 06:00:22 -04:00
|
|
|
sei();
|
2012-03-28 06:46:49 -03:00
|
|
|
running = false;
|
2011-11-28 01:01:23 -04:00
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
2011-12-02 07:45:48 -04:00
|
|
|
if (update_count == last_update_count) {
|
2012-03-05 06:00:22 -04:00
|
|
|
sei();
|
2012-03-28 06:46:49 -03:00
|
|
|
running = false;
|
2011-11-28 01:01:23 -04:00
|
|
|
return;
|
2011-11-25 23:47:06 -04:00
|
|
|
}
|
2011-12-02 07:45:48 -04:00
|
|
|
last_update_count = update_count;
|
2011-11-28 01:01:23 -04:00
|
|
|
|
2012-06-29 02:06:28 -03:00
|
|
|
sitl_update_gps(sitl.state.latitude, sitl.state.longitude,
|
|
|
|
sitl.state.altitude,
|
|
|
|
sitl.state.speedN, sitl.state.speedE, !sitl.gps_disable);
|
|
|
|
sitl_update_adc(sitl.state.rollDeg, sitl.state.pitchDeg, sitl.state.yawDeg,
|
|
|
|
sitl.state.rollRate, sitl.state.pitchRate, sitl.state.yawRate,
|
|
|
|
sitl.state.xAccel, sitl.state.yAccel, sitl.state.zAccel,
|
|
|
|
sitl.state.airspeed);
|
|
|
|
sitl_update_barometer(sitl.state.altitude);
|
|
|
|
sitl_update_compass(sitl.state.rollDeg, sitl.state.pitchDeg, sitl.state.heading);
|
2012-06-29 08:51:38 -03:00
|
|
|
|
|
|
|
// clear the ADC conversion flag,
|
|
|
|
// so the ADC code doesn't get stuck
|
|
|
|
ADCSRA &= ~_BV(ADSC);
|
|
|
|
|
2012-03-05 06:00:22 -04:00
|
|
|
sei();
|
2012-03-28 06:46:49 -03:00
|
|
|
running = false;
|
2011-11-16 21:49:56 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
|
|
|
|
/*
|
|
|
|
setup a timer used to prod the ISRs
|
|
|
|
*/
|
|
|
|
static void setup_timer(void)
|
|
|
|
{
|
|
|
|
struct itimerval it;
|
|
|
|
struct sigaction act;
|
|
|
|
|
|
|
|
act.sa_handler = timer_handler;
|
|
|
|
act.sa_flags = SA_RESTART|SA_NODEFER;
|
|
|
|
sigemptyset(&act.sa_mask);
|
|
|
|
sigaddset(&act.sa_mask, SIGALRM);
|
|
|
|
sigaction(SIGALRM, &act, NULL);
|
|
|
|
|
|
|
|
it.it_interval.tv_sec = 0;
|
|
|
|
it.it_interval.tv_usec = 1000; // 1KHz
|
|
|
|
it.it_value = it.it_interval;
|
|
|
|
|
|
|
|
setitimer(ITIMER_REAL, &it, NULL);
|
|
|
|
}
|
|
|
|
|
|
|
|
|
|
|
|
/*
|
|
|
|
setup for SITL handling
|
|
|
|
*/
|
|
|
|
void sitl_setup(void)
|
|
|
|
{
|
2012-03-05 06:04:26 -04:00
|
|
|
#ifndef __CYGWIN__
|
2011-11-16 21:49:56 -04:00
|
|
|
parent_pid = getppid();
|
2012-03-05 06:04:26 -04:00
|
|
|
#endif
|
2011-11-16 21:49:56 -04:00
|
|
|
|
2011-12-02 07:45:48 -04:00
|
|
|
rcout_addr.sin_family = AF_INET;
|
|
|
|
rcout_addr.sin_port = htons(RCOUT_PORT);
|
|
|
|
inet_pton(AF_INET, "127.0.0.1", &rcout_addr.sin_addr);
|
2011-11-16 21:49:56 -04:00
|
|
|
|
|
|
|
setup_timer();
|
2011-12-02 07:45:48 -04:00
|
|
|
setup_fdm();
|
2011-11-16 21:49:56 -04:00
|
|
|
sitl_setup_adc();
|
|
|
|
printf("Starting SITL input\n");
|
|
|
|
|
2011-11-25 23:47:06 -04:00
|
|
|
// setup some initial values
|
|
|
|
sitl_update_barometer(desktop_state.initial_height);
|
2011-12-02 00:15:12 -04:00
|
|
|
sitl_update_adc(0, 0, 0, 0, 0, 0, 0, 0, -9.8, 0);
|
2012-03-20 19:05:58 -03:00
|
|
|
sitl_update_compass(0, 0, 0);
|
2011-11-25 23:47:06 -04:00
|
|
|
sitl_update_gps(0, 0, 0, 0, 0, false);
|
2011-11-16 21:49:56 -04:00
|
|
|
}
|
2012-03-01 00:22:11 -04:00
|
|
|
|
|
|
|
|