Skip to content

Commit

Permalink
Rover: adjust for renaming of RC_Channel and GCS_MAVLink headers
Browse files Browse the repository at this point in the history
  • Loading branch information
peterbarker committed Dec 24, 2024
1 parent f76c3d0 commit c42258b
Show file tree
Hide file tree
Showing 6 changed files with 13 additions and 13 deletions.
2 changes: 1 addition & 1 deletion Rover/GCS_MAVLink_Rover.cpp
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
#include "Rover.h"

#include "GCS_Mavlink.h"
#include "GCS_MAVLink_Rover.h"

#include <AP_RPM/AP_RPM_config.h>
#include <AP_RangeFinder/AP_RangeFinder_Backend.h>
Expand Down
2 changes: 1 addition & 1 deletion Rover/GCS_Rover.h
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
#pragma once

#include <GCS_MAVLink/GCS.h>
#include "GCS_Mavlink.h"
#include "GCS_MAVLink_Rover.h"

class GCS_Rover : public GCS
{
Expand Down
14 changes: 7 additions & 7 deletions Rover/Parameters.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -234,42 +234,42 @@ const AP_Param::Info Rover::var_info[] = {
GOBJECT(rcmap, "RCMAP_", RCMapper),

// @Group: SR0_
// @Path: GCS_Mavlink.cpp
// @Path: GCS_MAVLink_Rover.cpp
GOBJECTN(_gcs.chan_parameters[0], gcs0, "SR0_", GCS_MAVLINK_Parameters),

#if MAVLINK_COMM_NUM_BUFFERS >= 2
// @Group: SR1_
// @Path: GCS_Mavlink.cpp
// @Path: GCS_MAVLink_Rover.cpp
GOBJECTN(_gcs.chan_parameters[1], gcs1, "SR1_", GCS_MAVLINK_Parameters),
#endif

#if MAVLINK_COMM_NUM_BUFFERS >= 3
// @Group: SR2_
// @Path: GCS_Mavlink.cpp
// @Path: GCS_MAVLink_Rover.cpp
GOBJECTN(_gcs.chan_parameters[2], gcs2, "SR2_", GCS_MAVLINK_Parameters),
#endif

#if MAVLINK_COMM_NUM_BUFFERS >= 4
// @Group: SR3_
// @Path: GCS_Mavlink.cpp
// @Path: GCS_MAVLink_Rover.cpp
GOBJECTN(_gcs.chan_parameters[3], gcs3, "SR3_", GCS_MAVLINK_Parameters),
#endif

#if MAVLINK_COMM_NUM_BUFFERS >= 5
// @Group: SR4_
// @Path: GCS_Mavlink.cpp
// @Path: GCS_MAVLink_Rover.cpp
GOBJECTN(_gcs.chan_parameters[4], gcs4, "SR4_", GCS_MAVLINK_Parameters),
#endif

#if MAVLINK_COMM_NUM_BUFFERS >= 6
// @Group: SR5_
// @Path: GCS_Mavlink.cpp
// @Path: GCS_MAVLink_Rover.cpp
GOBJECTN(_gcs.chan_parameters[5], gcs5, "SR5_", GCS_MAVLINK_Parameters),
#endif

#if MAVLINK_COMM_NUM_BUFFERS >= 7
// @Group: SR6_
// @Path: GCS_Mavlink.cpp
// @Path: GCS_MAVLink_Rover.cpp
GOBJECTN(_gcs.chan_parameters[6], gcs6, "SR6_", GCS_MAVLINK_Parameters),
#endif

Expand Down
2 changes: 1 addition & 1 deletion Rover/Parameters.h
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@

#include <AP_Common/AP_Common.h>

#include "RC_Channel.h"
#include "RC_Channel_Rover.h"
#include <AC_Avoidance/AC_Avoid.h>
#include "AC_Sprayer/AC_Sprayer.h"
#include <AP_AIS/AP_AIS.h>
Expand Down
2 changes: 1 addition & 1 deletion Rover/RC_Channel_Rover.cpp
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
#include "Rover.h"

#include "RC_Channel.h"
#include "RC_Channel_Rover.h"

// defining these two macros and including the RC_Channels_VarInfo
// header defines the parameter information common to all vehicle
Expand Down
4 changes: 2 additions & 2 deletions Rover/Rover.h
Original file line number Diff line number Diff line change
Expand Up @@ -64,13 +64,13 @@
#include "afs_rover.h"
#endif
#include "Parameters.h"
#include "GCS_Mavlink.h"
#include "GCS_MAVLink_Rover.h"
#include "GCS_Rover.h"
#include "AP_Rally.h"
#if AC_PRECLAND_ENABLED
#include <AC_PrecLand/AC_PrecLand.h>
#endif
#include "RC_Channel.h" // RC Channel Library
#include "RC_Channel_Rover.h" // RC Channel Library

#include "mode.h"

Expand Down

0 comments on commit c42258b

Please sign in to comment.