AP_FlashIface: support OctoSPI flash correctly

This commit is contained in:
Andy Piper 2022-08-31 15:24:27 +01:00 committed by Andrew Tridgell
parent 74812291e9
commit c7c8e1a8a9
2 changed files with 167 additions and 63 deletions

View File

@ -32,16 +32,22 @@
extern const AP_HAL::HAL& hal; extern const AP_HAL::HAL& hal;
#endif #endif
enum class SupportedDeviceType {
QuadSPI = 0,
OctoSPI = 1
};
struct supported_device { struct supported_device {
const char* name; const char* name;
uint8_t manufacturer_id; uint8_t manufacturer_id;
uint8_t device_id; uint8_t device_id;
SupportedDeviceType device_type;
}; };
static const struct supported_device supported_devices[] = { static const struct supported_device supported_devices[] = {
{"mt25q", 0x20, 0xBA}, // https://www.mouser.in/datasheet/2/671/mict_s_a0003959700_1-2290909.pdf {"mt25q", 0x20, 0xBA, SupportedDeviceType::QuadSPI}, // https://www.mouser.in/datasheet/2/671/mict_s_a0003959700_1-2290909.pdf
{"w25q", 0xEF, 0x40}, {"w25q", 0xEF, 0x40, SupportedDeviceType::QuadSPI},
{"w25q-dtr", 0xEF, 0x70} {"w25q-dtr", 0xEF, 0x70, SupportedDeviceType::QuadSPI},
}; };
#ifdef HAL_BOOTLOADER_BUILD #ifdef HAL_BOOTLOADER_BUILD
@ -64,7 +70,8 @@ static const struct supported_device supported_devices[] = {
#define CMD_MULTILINE_READ_ID 0xAF #define CMD_MULTILINE_READ_ID 0xAF
#define CMD_PAGE_PROGRAM 0x02 #define CMD_PAGE_PROGRAM 0x02
#define CMD_WRITE_DISABLE 0x04 #define CMD_WRITE_DISABLE 0x04
#define CMD_READ_STATUS 0x05 #define CMD_READ_STATUS_1 0x05
#define CMD_READ_STATUS_2 0x35
#define CMD_MASS_ERASE 0xC7 #define CMD_MASS_ERASE 0xC7
#define CMD_RESET_ENABLE 0x66 #define CMD_RESET_ENABLE 0x66
#define CMD_RESET_MEMORY 0x99 #define CMD_RESET_MEMORY 0x99
@ -84,6 +91,8 @@ static const struct supported_device supported_devices[] = {
#define SFDP_REV_1_6 0x0106 #define SFDP_REV_1_6 0x0106
// quad enable for winbond // quad enable for winbond
#define QUAD_ENABLE_B1R2 0x4 #define QUAD_ENABLE_B1R2 0x4
// octo enable for winbond
#define OCTO_ENABLE_B3R2 0x1
//#define DEBUG //#define DEBUG
@ -381,32 +390,65 @@ bool AP_FlashIface_JEDEC::detect_device()
_desc.page_prog_delay_us = (SFDP_GET_BITS(param_table[10], 8, 12) + 1) * unit; _desc.page_prog_delay_us = (SFDP_GET_BITS(param_table[10], 8, 12) + 1) * unit;
_desc.page_prog_timeout_us = _desc.page_prog_delay_us * timeout_mult; _desc.page_prog_timeout_us = _desc.page_prog_delay_us * timeout_mult;
uint8_t fast_read_dword = 2; // QuadSPI configuration dword
#if HAL_USE_OCTOSPI
// To use Octo SPI it must be both supported in hardware and configured
const bool octo_spi = supported_devices[_dev_list_idx].device_type == SupportedDeviceType::OctoSPI
&& SFDP_GET_BITS(param_table[16], 8, 15);
// Configure Quad Mode Enable and Read Sequence, Ref. JESD216D 6.4.8 6.4.10 6.4.18 if (octo_spi) {
if (!SFDP_GET_BIT(param_table[0], 21)) { fast_read_dword = 16;
}
#else
const bool octo_spi = false;
#endif
// Configure Octo/Quad Mode Enable and Read Sequence, Ref. JESD216D 6.4.8 6.4.10 6.4.18, 6.4.20
if (!octo_spi && !SFDP_GET_BIT(param_table[0], 21)) {
Debug("1-4-4 mode unsupported"); Debug("1-4-4 mode unsupported");
return false; return false;
} }
_desc.fast_read_ins = SFDP_GET_BITS(param_table[fast_read_dword], 8, 15);
// we get number of dummy clocks cycles needed, also include mode bits
_desc.fast_read_mode_clocks = SFDP_GET_BITS(param_table[fast_read_dword], 5, 7);
_desc.fast_read_dummy_cycles = SFDP_GET_BITS(param_table[fast_read_dword], 0, 4);
if (_desc.fast_read_ins == 0) {
Debug("Fast read unsupported");
return false;
}
if (!octo_spi) {
_desc.wide_mode_enable = SFDP_GET_BITS(param_table[14], 20, 22);
if (_desc.wide_mode_enable != 0b000 && _desc.wide_mode_enable != QUAD_ENABLE_B1R2) {
Debug("Unsupported Quad Enable Requirement 0x%x", _desc.wide_mode_enable);
return false;
}
if (SFDP_GET_BIT(param_table[14], 4) && _desc.wide_mode_enable != QUAD_ENABLE_B1R2) {
Debug("Unsupported Quad Enable Requirement: set QE bits");
return false;
}
}
#if HAL_USE_OCTOSPI
else {
_desc.wide_mode_enable = SFDP_GET_BITS(param_table[18], 20, 22);
if (_desc.wide_mode_enable != 0b000 && _desc.wide_mode_enable != OCTO_ENABLE_B3R2) {
Debug("Unsupported Octo Enable Requirement 0x%x", _desc.wide_mode_enable);
return false;
}
if (SFDP_GET_BIT(param_table[18], 5) && _desc.wide_mode_enable != OCTO_ENABLE_B3R2) {
Debug("Unsupported Quad Enable Requirement: set WREN bits");
return false;
}
}
#endif
// if (!SFDP_GET_BIT(param_table[4], 4)) { // if (!SFDP_GET_BIT(param_table[4], 4)) {
// Debug("Quad mode unsupported"); // Debug("Quad mode unsupported");
// return false; // return false;
// } // }
_desc.fast_read_ins = SFDP_GET_BITS(param_table[2], 8, 15);
// we get number of dummy clocks cycles needed, also include mode bits
_desc.fast_read_mode_clocks = SFDP_GET_BITS(param_table[2], 5, 7);
_desc.fast_read_dummy_cycles = SFDP_GET_BITS(param_table[2], 0, 4);
_desc.quad_mode_enable = SFDP_GET_BITS(param_table[14], 20, 22);
if (_desc.quad_mode_enable != 0b000 && _desc.quad_mode_enable != QUAD_ENABLE_B1R2) {
Debug("Unsupported Quad Enable Requirement 0x%x", _desc.quad_mode_enable);
return false;
}
if (SFDP_GET_BIT(param_table[14], 4) && _desc.quad_mode_enable != QUAD_ENABLE_B1R2) {
Debug("Unsupported Quad Enable Requirement: set QE bits");
return false;
}
// Configure XIP mode Ref. JESD216D 6.4.18 // Configure XIP mode Ref. JESD216D 6.4.18
if (SFDP_GET_BIT(param_table[14], 9)) { if (SFDP_GET_BIT(param_table[14], 9)) {
@ -430,7 +472,7 @@ bool AP_FlashIface_JEDEC::detect_device()
_desc.status_read_ins = 0x70; _desc.status_read_ins = 0x70;
} else if (SFDP_GET_BIT(param_table[13], 2)) { } else if (SFDP_GET_BIT(param_table[13], 2)) {
_desc.legacy_status_polling = true; _desc.legacy_status_polling = true;
_desc.status_read_ins = 0x05; _desc.status_read_ins = CMD_READ_STATUS_1;
} }
} }
initialised = true; initialised = true;
@ -441,13 +483,13 @@ bool AP_FlashIface_JEDEC::detect_device()
bool AP_FlashIface_JEDEC::configure_device() bool AP_FlashIface_JEDEC::configure_device()
{ {
// Enable 1-4-4 mode // Enable 1-4-4 mode
if (_desc.quad_mode_enable == QUAD_ENABLE_B1R2) { if (_desc.wide_mode_enable == QUAD_ENABLE_B1R2) {
uint8_t reg1, reg2; uint8_t reg1 = 0, reg2 = 0;
if (!read_reg(0x05, reg1)) { if (!read_reg(CMD_READ_STATUS_1, reg1)) {
Debug("Failed reg1 read"); Debug("Failed reg1 read");
return false; return false;
} }
if (!read_reg(0x35, reg2)) { if (!read_reg(CMD_READ_STATUS_2, reg2)) {
Debug("Failed reg2 read"); Debug("Failed reg2 read");
return false; return false;
} }
@ -479,13 +521,60 @@ bool AP_FlashIface_JEDEC::configure_device()
Debug("Failed to set QE bit"); Debug("Failed to set QE bit");
return false; return false;
} }
}
Debug("Device configured for 1-4-4 mode: QE bit 0x%x, fast read ins/cycles 0x%x/0x%x", Debug("Device configured for 1-4-4 mode: QE bit 0x%x, fast read ins/cycles 0x%x/0x%x",
_desc.quad_mode_enable, _desc.fast_read_ins, _desc.fast_read_dummy_cycles); _desc.quad_mode_enable, _desc.fast_read_ins, _desc.fast_read_dummy_cycles);
// Hurray! We are in 1-4-4 mode // Hurray! We are in wide mode
_quad_spi_mode = true; _wide_spi_mode = WSPIMode::QuadSPI;
}
#if HAL_USE_OCTOSPI
// Enable 1-8-8 mode
else if (_desc.wide_mode_enable == OCTO_ENABLE_B3R2) {
uint8_t reg2;
AP_HAL::WSPIDevice::CommandHeader read_reg {
.cmd = 0x65,
.cfg = AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE |
AP_HAL::WSPI::CFG_DATA_MODE_ONE_LINE |
AP_HAL::WSPI::CFG_ADDR_MODE_ONE_LINE |
AP_HAL::WSPI::CFG_ADDR_SIZE_8,
.addr = 0x02,
.alt = 0,
.dummy = 8,
};
_dev->set_cmd_header(read_reg);
if (!_dev->transfer(nullptr, 0, &reg2, sizeof(reg2))) {
Debug("Failed reg2 read");
return false;
}
write_enable();
wait_ready();
reg2 |= 0x4; // enable OE bit
if (!write_reg(0x31, reg2)) {
Debug("Failed OE write");
write_disable();
return false;
}
write_disable();
_dev->set_cmd_header(read_reg);
if (!_dev->transfer(nullptr, 0, &reg2, sizeof(reg2)) || (reg2 & 0x4) == 0) {
Debug("Failed to set OE bit");
return false;
}
Debug("Device configured for 1-8-8 mode: OE bit 0x%x, fast read ins/cycles 0x%x/0x%x",
_desc.wide_mode_enable, _desc.fast_read_ins, _desc.fast_read_dummy_cycles);
// Hurray! We are in wide mode
_wide_spi_mode = WSPIMode::OctoSPI;
}
#endif
return true; return true;
} }
@ -550,10 +639,10 @@ bool AP_FlashIface_JEDEC::read_reg(uint8_t read_ins, uint8_t &read_val)
} }
// sends instruction to write a register value in the chip // sends instruction to write a register value in the chip
bool AP_FlashIface_JEDEC::write_reg(uint8_t read_ins, uint8_t write_val) bool AP_FlashIface_JEDEC::write_reg(uint8_t write_ins, uint8_t write_val)
{ {
AP_HAL::WSPIDevice::CommandHeader cmd; AP_HAL::WSPIDevice::CommandHeader cmd;
cmd.cmd = read_ins; cmd.cmd = write_ins;
cmd.cfg = AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE | cmd.cfg = AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE |
AP_HAL::WSPI::CFG_DATA_MODE_ONE_LINE; AP_HAL::WSPI::CFG_DATA_MODE_ONE_LINE;
cmd.addr = 0; cmd.addr = 0;
@ -859,16 +948,19 @@ bool AP_FlashIface_JEDEC::read(uint32_t offset, uint8_t* data, uint32_t size)
cmd.alt = 0; cmd.alt = 0;
cmd.cfg = AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE | cmd.cfg = AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE |
AP_HAL::WSPI::CFG_ADDR_SIZE_24 | AP_HAL::WSPI::CFG_ADDR_SIZE_24 |
AP_HAL::WSPI::CFG_ALT_SIZE_8 | AP_HAL::WSPI::CFG_ALT_SIZE_8;
#if HAL_USE_QUADSPI if (_wide_spi_mode == WSPIMode::QuadSPI) {
AP_HAL::WSPI::CFG_ADDR_MODE_FOUR_LINES | cmd.cfg |= (AP_HAL::WSPI::CFG_ADDR_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_FOUR_LINES | AP_HAL::WSPI::CFG_DATA_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_FOUR_LINES; AP_HAL::WSPI::CFG_ALT_MODE_FOUR_LINES);
#else #if HAL_USE_OCTOSPI
AP_HAL::WSPI::CFG_ADDR_MODE_EIGHT_LINES | } else if (_wide_spi_mode == WSPIMode::OctoSPI) {
cmd.cfg |= (AP_HAL::WSPI::CFG_ADDR_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_EIGHT_LINES | AP_HAL::WSPI::CFG_DATA_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_EIGHT_LINES; AP_HAL::WSPI::CFG_ALT_MODE_EIGHT_LINES);
#endif #endif
}
if (_desc.fast_read_mode_clocks == 1){ if (_desc.fast_read_mode_clocks == 1){
cmd.dummy = _desc.fast_read_dummy_cycles - 1; cmd.dummy = _desc.fast_read_dummy_cycles - 1;
} else { } else {
@ -894,8 +986,12 @@ bool AP_FlashIface_JEDEC::read(uint32_t offset, uint8_t* data, uint32_t size)
*/ */
bool AP_FlashIface_JEDEC::is_device_busy() bool AP_FlashIface_JEDEC::is_device_busy()
{ {
// wait for peripheral to become free
while (_dev->is_busy()) {}
uint8_t status; uint8_t status;
read_reg(_desc.status_read_ins, status); read_reg(_desc.status_read_ins, status);
if (_desc.legacy_status_polling) { if (_desc.legacy_status_polling) {
return (status & 0x1); return (status & 0x1);
} else { } else {
@ -906,9 +1002,9 @@ bool AP_FlashIface_JEDEC::is_device_busy()
// wait for the chip to be ready for the next instruction // wait for the chip to be ready for the next instruction
void AP_FlashIface_JEDEC::wait_ready() void AP_FlashIface_JEDEC::wait_ready()
{ {
while (is_device_busy()) {} while (is_device_busy()) {
}
} }
/** /**
* @details Starts execution in place mode * @details Starts execution in place mode
@ -939,16 +1035,18 @@ bool AP_FlashIface_JEDEC::start_xip_mode(void** addr)
cmd.alt = 0xF0; // add M0-7 bits in alt to make up 32-bit address phase, sec 8.2.11 W25Q64JV reference cmd.alt = 0xF0; // add M0-7 bits in alt to make up 32-bit address phase, sec 8.2.11 W25Q64JV reference
cmd.cfg = AP_HAL::WSPI::CFG_ADDR_SIZE_24 | cmd.cfg = AP_HAL::WSPI::CFG_ADDR_SIZE_24 |
AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE | AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE |
#if HAL_USE_QUADSPI
AP_HAL::WSPI::CFG_ADDR_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_FOUR_LINES | /* Always 4 lines, note.*/
#else
AP_HAL::WSPI::CFG_ADDR_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_EIGHT_LINES | /* Always 4 lines, note.*/
#endif
AP_HAL::WSPI::CFG_ALT_SIZE_8; AP_HAL::WSPI::CFG_ALT_SIZE_8;
if (_wide_spi_mode == WSPIMode::QuadSPI) {
cmd.cfg |= (AP_HAL::WSPI::CFG_ADDR_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_FOUR_LINES);
#if HAL_USE_OCTOSPI
} else if (_wide_spi_mode == WSPIMode::OctoSPI) {
cmd.cfg |= (AP_HAL::WSPI::CFG_ADDR_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_EIGHT_LINES);
#endif
}
cmd.addr = 0; cmd.addr = 0;
cmd.dummy = _desc.fast_read_dummy_cycles; cmd.dummy = _desc.fast_read_dummy_cycles;
_dev->set_cmd_header(cmd); _dev->set_cmd_header(cmd);
@ -972,17 +1070,19 @@ bool AP_FlashIface_JEDEC::start_xip_mode(void** addr)
cmd.alt = 0; cmd.alt = 0;
cmd.cfg = AP_HAL::WSPI::CFG_ADDR_SIZE_24 | cmd.cfg = AP_HAL::WSPI::CFG_ADDR_SIZE_24 |
AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE | AP_HAL::WSPI::CFG_CMD_MODE_ONE_LINE |
#if HAL_USE_QUADSPI
AP_HAL::WSPI::CFG_ADDR_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_FOUR_LINES | /* Always 4 lines, note.*/
#else
AP_HAL::WSPI::CFG_ADDR_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_EIGHT_LINES |
#endif
AP_HAL::WSPI::CFG_ALT_SIZE_8 | AP_HAL::WSPI::CFG_ALT_SIZE_8 |
AP_HAL::WSPI::CFG_SIOO; AP_HAL::WSPI::CFG_SIOO;
if (_wide_spi_mode == WSPIMode::QuadSPI) {
cmd.cfg |= (AP_HAL::WSPI::CFG_ADDR_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_FOUR_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_FOUR_LINES);
#if HAL_USE_OCTOSPI
} else if (_wide_spi_mode == WSPIMode::OctoSPI) {
cmd.cfg |= (AP_HAL::WSPI::CFG_ADDR_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_DATA_MODE_EIGHT_LINES |
AP_HAL::WSPI::CFG_ALT_MODE_EIGHT_LINES);
#endif
}
cmd.addr = 0; cmd.addr = 0;
// correct dummy bytes because of addition of alt bytes // correct dummy bytes because of addition of alt bytes
cmd.dummy = _desc.fast_read_dummy_cycles - 1; cmd.dummy = _desc.fast_read_dummy_cycles - 1;

View File

@ -250,8 +250,12 @@ protected:
// Sends WSPI command without data // Sends WSPI command without data
bool send_cmd(uint8_t ins); bool send_cmd(uint8_t ins);
// Is device in quad spi mode // Is device in wide spi mode
bool _quad_spi_mode; enum class WSPIMode {
NormalSPI,
QuadSPI,
OctoSPI
} _wide_spi_mode;
AP_HAL::OwnPtr<AP_HAL::WSPIDevice> _dev; AP_HAL::OwnPtr<AP_HAL::WSPIDevice> _dev;
@ -286,7 +290,7 @@ protected:
uint8_t fast_read_ins; // instruction to do fast read, i.e. read any number of bytes in single trx uint8_t fast_read_ins; // instruction to do fast read, i.e. read any number of bytes in single trx
uint8_t fast_read_dummy_cycles; // number of dummy cycles after which the chip will respond with data uint8_t fast_read_dummy_cycles; // number of dummy cycles after which the chip will respond with data
uint8_t quad_mode_ins; // instruction to enter 4-4-4 mode uint8_t quad_mode_ins; // instruction to enter 4-4-4 mode
uint8_t quad_mode_enable; uint8_t wide_mode_enable;
bool quad_mode_rmw_seq; // use Read modify write sequence to enter 4-4-4 mode supported or not bool quad_mode_rmw_seq; // use Read modify write sequence to enter 4-4-4 mode supported or not
uint8_t status_read_ins; // read status of the chip, gets us if busy writing/erasing uint8_t status_read_ins; // read status of the chip, gets us if busy writing/erasing
bool legacy_status_polling; // check if legacy status polling supported or not bool legacy_status_polling; // check if legacy status polling supported or not