mirror of https://github.com/ArduPilot/ardupilot
Rover: add Log_Write_Depth
This commit is contained in:
parent
d34c87a457
commit
b69155793f
|
@ -40,6 +40,28 @@ void Rover::Log_Write_Attitude()
|
||||||
DataFlash.Log_Write_PID(LOG_PIDA_MSG, g2.attitude_control.get_throttle_speed_pid().get_pid_info());
|
DataFlash.Log_Write_PID(LOG_PIDA_MSG, g2.attitude_control.get_throttle_speed_pid().get_pid_info());
|
||||||
}
|
}
|
||||||
|
|
||||||
|
// Write a range finder depth message
|
||||||
|
void Rover::Log_Write_Depth()
|
||||||
|
{
|
||||||
|
// only log depth on boats with working downward facing range finders
|
||||||
|
if (!rover.is_boat() || !rangefinder.has_data_orient(ROTATION_PITCH_270)) {
|
||||||
|
return;
|
||||||
|
}
|
||||||
|
|
||||||
|
// get position
|
||||||
|
Location loc;
|
||||||
|
if (!rover.ahrs.get_position(loc)) {
|
||||||
|
return;
|
||||||
|
}
|
||||||
|
|
||||||
|
DataFlash.Log_Write("DPTH", "TimeUS,Lat,Lng,Depth",
|
||||||
|
"sDUm", "FGG0", "QLLf",
|
||||||
|
AP_HAL::micros64(),
|
||||||
|
loc.lat,
|
||||||
|
loc.lng,
|
||||||
|
(double)(rangefinder.distance_cm_orient(ROTATION_PITCH_270) * 0.01f));
|
||||||
|
}
|
||||||
|
|
||||||
struct PACKED log_Error {
|
struct PACKED log_Error {
|
||||||
LOG_PACKET_HEADER;
|
LOG_PACKET_HEADER;
|
||||||
uint64_t time_us;
|
uint64_t time_us;
|
||||||
|
|
|
@ -478,6 +478,7 @@ private:
|
||||||
// Log.cpp
|
// Log.cpp
|
||||||
void Log_Write_Arm_Disarm();
|
void Log_Write_Arm_Disarm();
|
||||||
void Log_Write_Attitude();
|
void Log_Write_Attitude();
|
||||||
|
void Log_Write_Depth();
|
||||||
void Log_Write_Error(uint8_t sub_system, uint8_t error_code);
|
void Log_Write_Error(uint8_t sub_system, uint8_t error_code);
|
||||||
void Log_Write_GuidedTarget(uint8_t target_type, const Vector3f& pos_target, const Vector3f& vel_target);
|
void Log_Write_GuidedTarget(uint8_t target_type, const Vector3f& pos_target, const Vector3f& vel_target);
|
||||||
void Log_Write_Nav_Tuning();
|
void Log_Write_Nav_Tuning();
|
||||||
|
|
|
@ -226,6 +226,7 @@ void Rover::read_rangefinders(void)
|
||||||
}
|
}
|
||||||
|
|
||||||
Log_Write_Rangefinder();
|
Log_Write_Rangefinder();
|
||||||
|
Log_Write_Depth();
|
||||||
|
|
||||||
// no object detected - reset after the turn time
|
// no object detected - reset after the turn time
|
||||||
if (obstacle.detected_count >= g.rangefinder_debounce &&
|
if (obstacle.detected_count >= g.rangefinder_debounce &&
|
||||||
|
|
Loading…
Reference in New Issue