MAVLinkProtocol.cc 16.3 KB
Newer Older
1 2 3 4 5 6 7 8 9
/****************************************************************************
 *
 *   (c) 2009-2016 QGROUNDCONTROL PROJECT <http://www.qgroundcontrol.org>
 *
 * QGroundControl is licensed according to the terms in the file
 * COPYING.md in the root of the source code directory.
 *
 ****************************************************************************/

pixhawk's avatar
pixhawk committed
10 11 12

/**
 * @file
pixhawk's avatar
pixhawk committed
13 14
 *   @brief Implementation of class MAVLinkProtocol
 *   @author Lorenz Meier <mail@qgroundcontrol.org>
pixhawk's avatar
pixhawk committed
15 16 17 18 19 20 21
 */

#include <inttypes.h>
#include <iostream>

#include <QDebug>
#include <QTime>
lm's avatar
lm committed
22
#include <QApplication>
23
#include <QSettings>
24
#include <QStandardPaths>
25
#include <QtEndian>
26
#include <QMetaType>
27 28
#include <QDir>
#include <QFileInfo>
pixhawk's avatar
pixhawk committed
29 30 31 32 33 34

#include "MAVLinkProtocol.h"
#include "UASInterface.h"
#include "UASInterface.h"
#include "UAS.h"
#include "LinkManager.h"
35
#include "QGCMAVLink.h"
36
#include "QGC.h"
Don Gagne's avatar
Don Gagne committed
37
#include "QGCApplication.h"
38
#include "QGCLoggingCategory.h"
39
#include "MultiVehicleManager.h"
40
#include "SettingsManager.h"
pixhawk's avatar
pixhawk committed
41

42
Q_DECLARE_METATYPE(mavlink_message_t)
43

44
QGC_LOGGING_CATEGORY(MAVLinkProtocolLog, "MAVLinkProtocolLog")
45

Don Gagne's avatar
Don Gagne committed
46 47 48
const char* MAVLinkProtocol::_tempLogFileTemplate = "FlightDataXXXXXX"; ///< Template for temporary log file
const char* MAVLinkProtocol::_logFileExtension = "mavlink";             ///< Extension for log files

pixhawk's avatar
pixhawk committed
49 50 51 52
/**
 * The default constructor will create a new MAVLink object sending heartbeats at
 * the MAVLINK_HEARTBEAT_DEFAULT_RATE to all connected links.
 */
53 54
MAVLinkProtocol::MAVLinkProtocol(QGCApplication* app, QGCToolbox* toolbox)
    : QGCTool(app, toolbox)
55 56
    , m_enable_version_check(true)
    , versionMismatchIgnore(false)
57
    , systemId(255)
58
    , _current_version(100)
59 60
    , _logSuspendError(false)
    , _logSuspendReplay(false)
61
    , _vehicleWasArmed(false)
62 63 64
    , _tempLogFile(QString("%2.%3").arg(_tempLogFileTemplate).arg(_logFileExtension))
    , _linkMgr(NULL)
    , _multiVehicleManager(NULL)
pixhawk's avatar
pixhawk committed
65
{
66 67 68 69 70
    memset(&totalReceiveCounter, 0, sizeof(totalReceiveCounter));
    memset(&totalLossCounter, 0, sizeof(totalLossCounter));
    memset(&totalErrorCounter, 0, sizeof(totalErrorCounter));
    memset(&currReceiveCounter, 0, sizeof(currReceiveCounter));
    memset(&currLossCounter, 0, sizeof(currLossCounter));
pixhawk's avatar
pixhawk committed
71 72
}

73 74 75 76 77 78
MAVLinkProtocol::~MAVLinkProtocol()
{
    storeSettings();
    _closeLogFile();
}

79 80 81 82 83 84 85 86 87 88 89 90 91 92 93 94 95 96
void MAVLinkProtocol::setVersion(unsigned version)
{
    QList<LinkInterface*> links = _linkMgr->links();

    for (int i = 0; i < links.length(); i++) {
        mavlink_status_t* mavlinkStatus = mavlink_get_channel_status(links[i]->mavlinkChannel());

        // Set flags for version
        if (version < 200) {
            mavlinkStatus->flags |= MAVLINK_STATUS_FLAG_OUT_MAVLINK1;
        } else {
            mavlinkStatus->flags &= ~MAVLINK_STATUS_FLAG_OUT_MAVLINK1;
        }
    }

    _current_version = version;
}

97 98 99 100 101 102 103 104 105 106 107 108 109 110 111 112 113 114 115 116 117 118 119
void MAVLinkProtocol::setToolbox(QGCToolbox *toolbox)
{
   QGCTool::setToolbox(toolbox);

   _linkMgr =               _toolbox->linkManager();
   _multiVehicleManager =   _toolbox->multiVehicleManager();

   qRegisterMetaType<mavlink_message_t>("mavlink_message_t");

   loadSettings();

   // All the *Counter variables are not initialized here, as they should be initialized
   // on a per-link basis before those links are used. @see resetMetadataForLink().

   // Initialize the list for tracking dropped messages to invalid.
   for (int i = 0; i < 256; i++)
   {
       for (int j = 0; j < 256; j++)
       {
           lastIndex[i][j] = -1;
       }
   }

120 121 122
   connect(this, &MAVLinkProtocol::protocolStatusMessage,   _app, &QGCApplication::criticalMessageBoxOnMainThread);
   connect(this, &MAVLinkProtocol::saveTelemetryLog,        _app, &QGCApplication::saveTelemetryLogOnMainThread);
   connect(this, &MAVLinkProtocol::checkTelemetrySavePath,  _app, &QGCApplication::checkTelemetrySavePathOnMainThread);
123

124 125
   connect(_multiVehicleManager, &MultiVehicleManager::vehicleAdded, this, &MAVLinkProtocol::_vehicleCountChanged);
   connect(_multiVehicleManager, &MultiVehicleManager::vehicleRemoved, this, &MAVLinkProtocol::_vehicleCountChanged);
126

127 128 129
   emit versionCheckChanged(m_enable_version_check);
}

130 131 132 133 134
void MAVLinkProtocol::loadSettings()
{
    // Load defaults from settings
    QSettings settings;
    settings.beginGroup("QGC_MAVLINK_PROTOCOL");
135
    enableVersionCheck(settings.value("VERSION_CHECK_ENABLED", m_enable_version_check).toBool());
136 137 138

    // Only set system id if it was valid
    int temp = settings.value("GCS_SYSTEM_ID", systemId).toInt();
139 140
    if (temp > 0 && temp < 256)
    {
141 142 143 144 145 146 147 148 149
        systemId = temp;
    }
}

void MAVLinkProtocol::storeSettings()
{
    // Store settings
    QSettings settings;
    settings.beginGroup("QGC_MAVLINK_PROTOCOL");
150
    settings.setValue("VERSION_CHECK_ENABLED", m_enable_version_check);
151
    settings.setValue("GCS_SYSTEM_ID", systemId);
152
    // Parameter interface settings
153 154
}

155 156
void MAVLinkProtocol::resetMetadataForLink(const LinkInterface *link)
{
157
    int channel = link->mavlinkChannel();
158 159 160 161 162
    totalReceiveCounter[channel] = 0;
    totalLossCounter[channel] = 0;
    totalErrorCounter[channel] = 0;
    currReceiveCounter[channel] = 0;
    currLossCounter[channel] = 0;
163 164
}

pixhawk's avatar
pixhawk committed
165 166 167 168 169 170 171
/**
 * This method parses all incoming bytes and constructs a MAVLink packet.
 * It can handle multiple links in parallel, as each link has it's own buffer/
 * parsing state machine.
 * @param link The interface to read from
 * @see LinkInterface
 **/
172
void MAVLinkProtocol::receiveBytes(LinkInterface* link, QByteArray b)
pixhawk's avatar
pixhawk committed
173
{
Don Gagne's avatar
Don Gagne committed
174 175 176
    // Since receiveBytes signals cross threads we can end up with signals in the queue
    // that come through after the link is disconnected. For these we just drop the data
    // since the link is closed.
177
    if (!_linkMgr->containsLink(link)) {
Don Gagne's avatar
Don Gagne committed
178 179
        return;
    }
Gus Grubba's avatar
Gus Grubba committed
180

181
//    receiveMutex.lock();
pixhawk's avatar
pixhawk committed
182 183
    mavlink_message_t message;
    mavlink_status_t status;
184

185
    int mavlinkChannel = link->mavlinkChannel();
186

187 188 189
    static int nonmavlinkCount = 0;
    static bool checkedUserNonMavlink = false;
    static bool warnedUserNonMavlink = false;
190

191
    for (int position = 0; position < b.size(); position++) {
192
        unsigned int decodeState = mavlink_parse_char(mavlinkChannel, (uint8_t)(b[position]), &message, &status);
193

194
        if (decodeState == 0 && !link->decodedFirstMavlinkPacket())
195 196
        {
            nonmavlinkCount++;
197
            if (nonmavlinkCount > 2000 && !warnedUserNonMavlink)
198
            {
199
                //2000 bytes with no mavlink message. Are we connected to a mavlink capable device?
200 201 202 203 204 205 206 207
                if (!checkedUserNonMavlink)
                {
                    link->requestReset();
                    checkedUserNonMavlink = true;
                }
                else
                {
                    warnedUserNonMavlink = true;
208
                    emit protocolStatusMessage(tr("MAVLink Protocol"), tr("There is a MAVLink Version or Baud Rate Mismatch. "
209
                                                                          "Please check if the baud rates of %1 and your autopilot are the same.").arg(qgcApp()->applicationName()));
210 211 212
                }
            }
        }
213 214
        if (decodeState == 1)
        {
215
            if (!link->decodedFirstMavlinkPacket()) {
216 217
                mavlink_status_t* mavlinkStatus = mavlink_get_channel_status(mavlinkChannel);
                if (!(mavlinkStatus->flags & MAVLINK_STATUS_FLAG_IN_MAVLINK1) && (mavlinkStatus->flags & MAVLINK_STATUS_FLAG_OUT_MAVLINK1)) {
218
                    qDebug() << "Switching outbound to mavlink 2.0 due to incoming mavlink 2.0 packet:" << mavlinkStatus << mavlinkChannel << mavlinkStatus->flags;
219 220
                    mavlinkStatus->flags &= ~MAVLINK_STATUS_FLAG_OUT_MAVLINK1;
                }
221
                link->setDecodedFirstMavlinkPacket(true);
Don Gagne's avatar
Don Gagne committed
222 223
            }

pixhawk's avatar
pixhawk committed
224
            // Log data
Don Gagne's avatar
Don Gagne committed
225
            if (!_logSuspendError && !_logSuspendReplay && _tempLogFile.isOpen()) {
226 227 228 229 230 231 232 233 234 235 236 237 238 239 240
                uint8_t buf[MAVLINK_MAX_PACKET_LEN+sizeof(quint64)];

                // Write the uint64 time in microseconds in big endian format before the message.
                // This timestamp is saved in UTC time. We are only saving in ms precision because
                // getting more than this isn't possible with Qt without a ton of extra code.
                quint64 time = (quint64)QDateTime::currentMSecsSinceEpoch() * 1000;
                qToBigEndian(time, buf);

                // Then write the message to the buffer
                int len = mavlink_msg_to_send_buffer(buf + sizeof(quint64), &message);

                // Determine how many bytes were written by adding the timestamp size to the message size
                len += sizeof(quint64);

                // Now write this timestamp/message pair to the log.
241
                QByteArray b((const char*)buf, len);
Don Gagne's avatar
Don Gagne committed
242
                if(_tempLogFile.write(b) != len)
243
                {
244
                    // If there's an error logging data, raise an alert and stop logging.
245
                    emit protocolStatusMessage(tr("MAVLink Protocol"), tr("MAVLink Logging failed. Could not write to file %1, logging disabled.").arg(_tempLogFile.fileName()));
Don Gagne's avatar
Don Gagne committed
246 247
                    _stopLogging();
                    _logSuspendError = true;
248
                }
Gus Grubba's avatar
Gus Grubba committed
249

Don Gagne's avatar
Don Gagne committed
250
                // Check for the vehicle arming going by. This is used to trigger log save.
251
                if (!_vehicleWasArmed && message.msgid == MAVLINK_MSG_ID_HEARTBEAT) {
Don Gagne's avatar
Don Gagne committed
252 253 254
                    mavlink_heartbeat_t state;
                    mavlink_msg_heartbeat_decode(&message, &state);
                    if (state.base_mode & MAV_MODE_FLAG_DECODE_POSITION_SAFETY) {
255
                        _vehicleWasArmed = true;
Don Gagne's avatar
Don Gagne committed
256 257
                    }
                }
pixhawk's avatar
pixhawk committed
258 259
            }

260
            if (message.msgid == MAVLINK_MSG_ID_HEARTBEAT) {
Don Gagne's avatar
Don Gagne committed
261 262
                // Start loggin on first heartbeat
                _startLogging();
263 264
                mavlink_heartbeat_t heartbeat;
                mavlink_msg_heartbeat_decode(&message, &heartbeat);
265
                emit vehicleHeartbeatInfo(link, message.sysid, message.compid, heartbeat.mavlink_version, heartbeat.autopilot, heartbeat.type);
pixhawk's avatar
pixhawk committed
266
            }
267

268
            // Increase receive counter
269 270
            totalReceiveCounter[mavlinkChannel]++;
            currReceiveCounter[mavlinkChannel]++;
271

272 273 274 275
            // Determine what the next expected sequence number is, accounting for
            // never having seen a message for this system/component pair.
            int lastSeq = lastIndex[message.sysid][message.compid];
            int expectedSeq = (lastSeq == -1) ? message.seq : (lastSeq + 1);
276

277 278 279
            // And if we didn't encounter that sequence number, record the error
            if (message.seq != expectedSeq)
            {
280

281 282
                // Determine how many messages were skipped
                int lostMessages = message.seq - expectedSeq;
283

284 285 286 287 288
                // Out of order messages or wraparound can cause this, but we just ignore these conditions for simplicity
                if (lostMessages < 0)
                {
                    lostMessages = 0;
                }
289

290
                // And log how many were lost for all time and just this timestep
291 292
                totalLossCounter[mavlinkChannel] += lostMessages;
                currLossCounter[mavlinkChannel] += lostMessages;
293
            }
294

295 296
            // And update the last sequence number for this system/component pair
            lastIndex[message.sysid][message.compid] = expectedSeq;
297

298
            // Update on every 32th packet
299
            if ((totalReceiveCounter[mavlinkChannel] & 0x1F) == 0)
300 301 302
            {
                // Calculate new loss ratio
                // Receive loss
303 304
                float receiveLossPercent = (double)currLossCounter[mavlinkChannel]/(double)(currReceiveCounter[mavlinkChannel]+currLossCounter[mavlinkChannel]);
                receiveLossPercent *= 100.0f;
305 306
                currLossCounter[mavlinkChannel] = 0;
                currReceiveCounter[mavlinkChannel] = 0;
307 308
                emit receiveLossPercentChanged(message.sysid, receiveLossPercent);
                emit receiveLossTotalChanged(message.sysid, totalLossCounter[mavlinkChannel]);
309
            }
310

311 312 313 314
            // The packet is emitted as a whole, as it is only 255 - 261 bytes short
            // kind of inefficient, but no issue for a groundstation pc.
            // It buys as reentrancy for the whole code over all threads
            emit messageReceived(link, message);
pixhawk's avatar
pixhawk committed
315 316 317 318 319 320 321 322 323 324 325 326
        }
    }
}

/**
 * @return The name of this protocol
 **/
QString MAVLinkProtocol::getName()
{
    return QString(tr("MAVLink protocol"));
}

327
/** @return System id of this application */
328
int MAVLinkProtocol::getSystemId()
329
{
330 331 332 333 334 335
    return systemId;
}

void MAVLinkProtocol::setSystemId(int id)
{
    systemId = id;
336 337 338
}

/** @return Component id of this application */
339
int MAVLinkProtocol::getComponentId()
340
{
341
    return 0;
342 343
}

lm's avatar
lm committed
344 345 346
void MAVLinkProtocol::enableVersionCheck(bool enabled)
{
    m_enable_version_check = enabled;
347
    emit versionCheckChanged(enabled);
lm's avatar
lm committed
348 349
}

350
void MAVLinkProtocol::_vehicleCountChanged(void)
Don Gagne's avatar
Don Gagne committed
351
{
352
    int count = _multiVehicleManager->vehicles()->count();
Don Gagne's avatar
Don Gagne committed
353 354 355 356 357 358
    if (count == 0) {
        // Last vehicle is gone, close out logging
        _stopLogging();
    }
}

Don Gagne's avatar
Don Gagne committed
359 360 361 362 363 364 365 366 367 368 369 370 371 372 373 374 375 376 377
/// @brief Closes the log file if it is open
bool MAVLinkProtocol::_closeLogFile(void)
{
    if (_tempLogFile.isOpen()) {
        if (_tempLogFile.size() == 0) {
            // Don't save zero byte files
            _tempLogFile.remove();
            return false;
        } else {
            _tempLogFile.flush();
            _tempLogFile.close();
            return true;
        }
    }
    return false;
}

void MAVLinkProtocol::_startLogging(void)
{
378
    //-- Are we supposed to write logs?
379 380 381
    if (qgcApp()->runningUnitTests()) {
        return;
    }
382 383 384 385 386 387 388 389
#ifdef __mobile__
    //-- Mobile build don't write to /tmp unless told to do so
    if (!_app->toolbox()->settingsManager()->appSettings()->telemetrySave()->rawValue().toBool()) {
        return;
    }
#endif
    //-- Log is always written to a temp file. If later the user decides they want
    //   it, it's all there for them.
Don Gagne's avatar
Don Gagne committed
390 391 392 393 394 395 396 397 398 399
    if (!_tempLogFile.isOpen()) {
        if (!_logSuspendReplay) {
            if (!_tempLogFile.open()) {
                emit protocolStatusMessage(tr("MAVLink Protocol"), tr("Opening Flight Data file for writing failed. "
                                                                      "Unable to write to %1. Please choose a different file location.").arg(_tempLogFile.fileName()));
                _closeLogFile();
                _logSuspendError = true;
                return;
            }

400
            qDebug() << "Temp log" << _tempLogFile.fileName();
401
            emit checkTelemetrySavePath();
402

Don Gagne's avatar
Don Gagne committed
403
            _logSuspendError = false;
Don Gagne's avatar
Don Gagne committed
404 405 406 407 408 409
        }
    }
}

void MAVLinkProtocol::_stopLogging(void)
{
410 411 412 413 414 415 416 417
    if (_tempLogFile.isOpen()) {
        if (_closeLogFile()) {
            if ((_vehicleWasArmed || _app->toolbox()->settingsManager()->appSettings()->telemetrySaveNotArmed()->rawValue().toBool()) &&
                _app->toolbox()->settingsManager()->appSettings()->telemetrySave()->rawValue().toBool()) {
                emit saveTelemetryLog(_tempLogFile.fileName());
            } else {
                QFile::remove(_tempLogFile.fileName());
            }
418
        }
Don Gagne's avatar
Don Gagne committed
419
    }
420
    _vehicleWasArmed = false;
Don Gagne's avatar
Don Gagne committed
421 422 423 424 425
}

/// @brief Checks the temp directory for log files which may have been left there.
///         This could happen if QGC crashes without the temp log file being saved.
///         Give the user an option to save these orphaned files.
426
void MAVLinkProtocol::checkForLostLogFiles(void)
Don Gagne's avatar
Don Gagne committed
427 428
{
    QDir tempDir(QStandardPaths::writableLocation(QStandardPaths::TempLocation));
Gus Grubba's avatar
Gus Grubba committed
429

Don Gagne's avatar
Don Gagne committed
430 431 432
    QString filter(QString("*.%1").arg(_logFileExtension));
    QFileInfoList fileInfoList = tempDir.entryInfoList(QStringList(filter), QDir::Files);
    qDebug() << "Orphaned log file count" << fileInfoList.count();
Gus Grubba's avatar
Gus Grubba committed
433

Don Gagne's avatar
Don Gagne committed
434 435 436 437 438 439 440
    foreach(const QFileInfo fileInfo, fileInfoList) {
        qDebug() << "Orphaned log file" << fileInfo.filePath();
        if (fileInfo.size() == 0) {
            // Delete all zero length files
            QFile::remove(fileInfo.filePath());
            continue;
        }
441
        emit saveTelemetryLog(fileInfo.filePath());
Don Gagne's avatar
Don Gagne committed
442 443 444 445 446 447 448
    }
}

void MAVLinkProtocol::suspendLogForReplay(bool suspend)
{
    _logSuspendReplay = suspend;
}
449 450 451 452

void MAVLinkProtocol::deleteTempLogFiles(void)
{
    QDir tempDir(QStandardPaths::writableLocation(QStandardPaths::TempLocation));
Gus Grubba's avatar
Gus Grubba committed
453

454 455
    QString filter(QString("*.%1").arg(_logFileExtension));
    QFileInfoList fileInfoList = tempDir.entryInfoList(QStringList(filter), QDir::Files);
Gus Grubba's avatar
Gus Grubba committed
456

457 458 459 460
    foreach(const QFileInfo fileInfo, fileInfoList) {
        QFile::remove(fileInfo.filePath());
    }
}
461