public inbox for devel@edk2.groups.io
 help / color / mirror / Atom feed
From: Pete Batard <pete@akeo.ie>
To: edk2-devel@lists.01.org
Subject: [PATCH v5 edk2-platforms 05/22] Platform/RaspberryPi/RPi3: Add platform library
Date: Tue,  5 Feb 2019 16:25:20 +0000	[thread overview]
Message-ID: <20190205162537.6472-6-pete@akeo.ie> (raw)
In-Reply-To: <20190205162537.6472-1-pete@akeo.ie>

A platform helper library, relying on low level Mailbox messaging
between the CPU and VideoCore to obtain current platform information,
that is used by various services and drivers.

Contributed-under: TianoCore Contribution Agreement 1.1
Signed-off-by: Pete Batard <pete@akeo.ie>
---
 Platform/RaspberryPi/RPi3/Include/IndustryStandard/RpiMbox.h              | 108 +++++++++++++
 Platform/RaspberryPi/RPi3/Library/PlatformLib/AArch64/RaspberryPiHelper.S | 107 +++++++++++++
 Platform/RaspberryPi/RPi3/Library/PlatformLib/PlatformLib.inf             |  65 ++++++++
 Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPi.c               |  99 ++++++++++++
 Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPiMem.c            | 160 ++++++++++++++++++++
 5 files changed, 539 insertions(+)

diff --git a/Platform/RaspberryPi/RPi3/Include/IndustryStandard/RpiMbox.h b/Platform/RaspberryPi/RPi3/Include/IndustryStandard/RpiMbox.h
new file mode 100644
index 000000000000..8547ad05ba61
--- /dev/null
+++ b/Platform/RaspberryPi/RPi3/Include/IndustryStandard/RpiMbox.h
@@ -0,0 +1,108 @@
+/** @file
+ *
+ * Copyright (c) 2019, Pete Batard <pete@akeo.ie>
+ * Copyright (c) 2016, Linaro Limited. All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are met:
+ *
+ * Redistributions of source code must retain the above copyright notice, this
+ * list of conditions and the following disclaimer.
+ *
+ * Redistributions in binary form must reproduce the above copyright notice,
+ * this list of conditions and the following disclaimer in the documentation
+ * and/or other materials provided with the distribution.
+ *
+ * Neither the name of ARM nor the names of its contributors may be used
+ * to endorse or promote products derived from this software without specific
+ * prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS"
+ * AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE
+ * IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE
+ * ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE
+ * LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR
+ * CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF
+ * SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS
+ * INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN
+ * CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE)
+ * ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
+ * POSSIBILITY OF SUCH DAMAGE.
+ *
+ **/
+
+#ifndef __RASPBERRY_PI_MAILBOX_H__
+#define __RASPBERRY_PI_MAILBOX_H__
+
+/* Mailbox channels */
+#define RPI_MBOX_PM_CHANNEL                                   0
+#define RPI_MBOX_FB_CHANNEL                                   1
+#define RPI_MBOX_VUART_CHANNEL                                2
+#define RPI_MBOX_VCHIQ_CHANNEL                                3
+#define RPI_MBOX_LED_CHANNEL                                  4
+#define RPI_MBOX_BUTTON_CHANNEL                               5
+#define RPI_MBOX_TOUCHSCREEN_CHANNEL                          6
+/* Request from ARM for response by VideoCore */
+#define RPI_MBOX_VC_CHANNEL                                   8
+/* Request from VideoCore for response by ARM */
+#define RPI_MBOX_ARM_CHANNEL                                  9
+
+#define RPI_MBOX_RESP_SUCCESS                                 0x80000000
+#define RPI_MBOX_RESP_FAILURE                                 0x80000001
+
+#define RPI_MBOX_VALUE_SIZE_RESPONSE_MASK                     BIT31
+
+#define RPI_MBOX_GET_REVISION                                 0x00000001
+#define RPI_MBOX_GET_BOARD_MODEL                              0x00010001
+#define RPI_MBOX_GET_BOARD_REVISION                           0x00010002
+#define RPI_MBOX_GET_MAC_ADDRESS                              0x00010003
+#define RPI_MBOX_GET_BOARD_SERIAL                             0x00010004
+#define RPI_MBOX_GET_ARM_MEMSIZE                              0x00010005
+
+#define RPI_MBOX_SET_POWER_STATE                              0x00028001
+
+#define RPI_MBOX_POWER_STATE_SDHCI                            0x00000000
+#define RPI_MBOX_POWER_STATE_UART0                            0x00000001
+#define RPI_MBOX_POWER_STATE_UART1                            0x00000002
+#define RPI_MBOX_POWER_STATE_USB_HCD                          0x00000003
+#define RPI_MBOX_POWER_STATE_I2C0                             0x00000004
+#define RPI_MBOX_POWER_STATE_I2C1                             0x00000005
+#define RPI_MBOX_POWER_STATE_I2C2                             0x00000006
+#define RPI_MBOX_POWER_STATE_SPI                              0x00000007
+#define RPI_MBOX_POWER_STATE_CCP2TX                           0x00000008
+
+#define RPI_MBOX_GET_CLOCK_RATE                               0x00030002
+#define RPI_MBOX_GET_MAX_CLOCK_RATE                           0x00030004
+#define RPI_MBOX_GET_MIN_CLOCK_RATE                           0x00030007
+
+#define RPI_MBOX_SET_CLOCK_RATE                               0x00038002
+#define RPI_MBOX_SET_GPIO                                     0x00038041
+
+#define RPI_MBOX_GET_FB_GEOMETRY                              0x00040003
+#define RPI_MBOX_GET_FB_LINELENGTH                            0x00040008
+#define RPI_MBOX_GET_FB_COLOR_DEPTH                           0x00040005
+#define RPI_MBOX_GET_FB_REGION                                0x00040001
+
+#define RPI_MBOX_SET_FB_PGEOM                                 0x00048003
+#define RPI_MBOX_SET_FB_VGEOM                                 0x00048004
+#define RPI_MBOX_SET_FB_DEPTH                                 0x00048005
+#define RPI_MBOX_ALLOC_FB                                     0x00040001
+#define RPI_MBOX_FREE_FB                                      0x00048001
+
+#define RPI_MBOX_GET_COMMAND_LINE                             0x00050001
+
+#define RPI_MBOX_POWER_STATE_ENABLE                           BIT0
+#define RPI_MBOX_POWER_STATE_WAIT                             BIT1
+
+#define RPI_MBOX_CLOCK_RATE_EMMC                              0x000000001
+#define RPI_MBOX_CLOCK_RATE_UART                              0x000000002
+#define RPI_MBOX_CLOCK_RATE_ARM                               0x000000003
+#define RPI_MBOX_CLOCK_RATE_CORE                              0x000000004
+#define RPI_MBOX_CLOCK_RATE_V3D                               0x000000005
+#define RPI_MBOX_CLOCK_RATE_H264                              0x000000006
+#define RPI_MBOX_CLOCK_RATE_ISP                               0x000000007
+#define RPI_MBOX_CLOCK_RATE_SDRAM                             0x000000008
+#define RPI_MBOX_CLOCK_RATE_PIXEL                             0x000000009
+#define RPI_MBOX_CLOCK_RATE_PWM                               0x00000000a
+
+#endif /* __RASPBERRY_PI_MAILBOX_H__ */
diff --git a/Platform/RaspberryPi/RPi3/Library/PlatformLib/AArch64/RaspberryPiHelper.S b/Platform/RaspberryPi/RPi3/Library/PlatformLib/AArch64/RaspberryPiHelper.S
new file mode 100644
index 000000000000..9638259700db
--- /dev/null
+++ b/Platform/RaspberryPi/RPi3/Library/PlatformLib/AArch64/RaspberryPiHelper.S
@@ -0,0 +1,107 @@
+/** @file
+ *
+ *  Copyright (c) 2016, Linaro Limited. All rights reserved.
+ *  Copyright (c) 2011-2013, ARM Limited. All rights reserved.
+ *
+ *  This program and the accompanying materials
+ *  are licensed and made available under the terms and conditions of the BSD License
+ *  which accompanies this distribution.  The full text of the license may be found at
+ *  http://opensource.org/licenses/bsd-license.php
+ *
+ *  THE PROGRAM IS DISTRIBUTED UNDER THE BSD LICENSE ON AN "AS IS" BASIS,
+ *  WITHOUT WARRANTIES OR REPRESENTATIONS OF ANY KIND, EITHER EXPRESS OR IMPLIED.
+ *
+ **/
+
+#include <AsmMacroIoLibV8.h>
+#include <Library/ArmLib.h>
+#include <IndustryStandard/Bcm2836.h>
+#include <IndustryStandard/RpiMbox.h>
+
+#define MAX_TRIES     0x100000
+
+    .macro  drain
+    mov     x5, #MAX_TRIES
+0:  ldr     w6, [x4, #BCM2836_MBOX_STATUS_OFFSET]
+    tbnz    w6, #BCM2836_MBOX_STATUS_EMPTY, 1f
+    dmb     ld
+    ldr     wzr, [x4, #BCM2836_MBOX_READ_OFFSET]
+    subs    x5, x5, #1
+    b.ne    0b
+1:
+    .endm
+
+    .macro  poll, status
+    mov     x5, #MAX_TRIES
+0:  ldr     w6, [x4, #BCM2836_MBOX_STATUS_OFFSET]
+    tbz     w6, #\status, 1f
+    dmb     ld
+    subs    x5, x5, #1
+    b.ne    0b
+1:
+    .endm
+
+ASM_FUNC (ArmPlatformPeiBootAction)
+    adr     x0, .Lmeminfo_buffer
+    mov     x1, #FixedPcdGet64 (PcdDmaDeviceOffset)
+    orr     x0, x0, #RPI_MBOX_VC_CHANNEL
+    add     x0, x0, x1
+
+    MOV32   (x4, BCM2836_MBOX_BASE_ADDRESS)
+
+    drain
+    poll    BCM2836_MBOX_STATUS_FULL
+    str     w0, [x4, #BCM2836_MBOX_WRITE_OFFSET]
+    dmb     sy
+    poll    BCM2836_MBOX_STATUS_EMPTY
+    dmb     sy
+    ldr     wzr, [x4, #BCM2836_MBOX_READ_OFFSET]
+    dmb     ld
+
+    ldr     w0, .Lmemsize
+    sub     x0, x0, #1
+    adr     x1, mSystemMemoryEnd
+    str     x0, [x1]
+    ret
+
+    .align  4
+.Lmeminfo_buffer:
+    .long   .Lbuffer_size
+    .long   0x0
+    .long   RPI_MBOX_GET_ARM_MEMSIZE
+    .long   8                           // buf size
+    .long   0                           // input len
+    .long   0                           // mem base
+.Lmemsize:
+    .long   0                           // mem size
+    .long   0                           // end tag
+    .set    .Lbuffer_size, . - .Lmeminfo_buffer
+
+//UINTN
+//ArmPlatformGetPrimaryCoreMpId (
+//  VOID
+//  );
+ASM_FUNC (ArmPlatformGetPrimaryCoreMpId)
+    MOV32  (w0, FixedPcdGet32 (PcdArmPrimaryCore))
+    ret
+
+//UINTN
+//ArmPlatformIsPrimaryCore (
+//  IN UINTN MpId
+//  );
+ASM_FUNC (ArmPlatformIsPrimaryCore)
+    mov   x0, #1
+    ret
+
+//UINTN
+//ArmPlatformGetCorePosition (
+//  IN UINTN MpId
+//  );
+// With this function: CorePos = (ClusterId * 4) + CoreId
+ASM_FUNC (ArmPlatformGetCorePosition)
+    and   x1, x0, #ARM_CORE_MASK
+    and   x0, x0, #ARM_CLUSTER_MASK
+    add   x0, x1, x0, LSR #6
+    ret
+
+ASM_FUNCTION_REMOVE_IF_UNREFERENCED
diff --git a/Platform/RaspberryPi/RPi3/Library/PlatformLib/PlatformLib.inf b/Platform/RaspberryPi/RPi3/Library/PlatformLib/PlatformLib.inf
new file mode 100644
index 000000000000..a4506888f1a7
--- /dev/null
+++ b/Platform/RaspberryPi/RPi3/Library/PlatformLib/PlatformLib.inf
@@ -0,0 +1,65 @@
+#/** @file
+#
+#  Copyright (c) 2017-2018, Andrei Warkentin <andrey.warkentin@gmail.com>
+#  Copyright (c) 2014-2016, Linaro Limited. All rights reserved.
+#  Copyright (c) 2011-2014, ARM Limited. All rights reserved.
+#
+#  This program and the accompanying materials
+#  are licensed and made available under the terms and conditions of the BSD License
+#  which accompanies this distribution.  The full text of the license may be found at
+#  http://opensource.org/licenses/bsd-license.php
+#
+#  THE PROGRAM IS DISTRIBUTED UNDER THE BSD LICENSE ON AN "AS IS" BASIS,
+#  WITHOUT WARRANTIES OR REPRESENTATIONS OF ANY KIND, EITHER EXPRESS OR IMPLIED.
+#
+#**/
+
+[Defines]
+  INF_VERSION                    = 0x0001001A
+  BASE_NAME                      = PlatformLib
+  FILE_GUID                      = 050182ef-f708-4148-b4bc-256cabf74fea
+  MODULE_TYPE                    = BASE
+  VERSION_STRING                 = 1.0
+  LIBRARY_CLASS                  = ArmPlatformLib|SEC PEIM
+
+[Packages]
+  MdePkg/MdePkg.dec
+  MdeModulePkg/MdeModulePkg.dec
+  EmbeddedPkg/EmbeddedPkg.dec
+  ArmPkg/ArmPkg.dec
+  ArmPlatformPkg/ArmPlatformPkg.dec
+  Silicon/Broadcom/Bcm283x/Bcm283x.dec
+  Platform/RaspberryPi/RPi3/RPi3.dec
+
+[LibraryClasses]
+  ArmLib
+  FdtLib
+  IoLib
+  MemoryAllocationLib
+  PcdLib
+  PrintLib
+
+[Sources.common]
+  RaspberryPi.c
+  RaspberryPiMem.c
+
+[Sources.AARCH64]
+  AArch64/RaspberryPiHelper.S
+
+[FixedPcd]
+  gArmTokenSpaceGuid.PcdFdBaseAddress
+  gArmTokenSpaceGuid.PcdFvBaseAddress
+  gArmPlatformTokenSpaceGuid.PcdCoreCount
+  gArmTokenSpaceGuid.PcdArmPrimaryCoreMask
+  gArmTokenSpaceGuid.PcdArmPrimaryCore
+  gArmTokenSpaceGuid.PcdFdSize
+  gEmbeddedTokenSpaceGuid.PcdDmaDeviceOffset
+  gArmTokenSpaceGuid.PcdSystemMemoryBase
+  gArmTokenSpaceGuid.PcdSystemMemorySize
+  gRaspberryPiTokenSpaceGuid.PcdNvStorageEventLogSize
+  gEfiMdeModulePkgTokenSpaceGuid.PcdFlashNvStorageVariableSize
+  gEfiMdeModulePkgTokenSpaceGuid.PcdFlashNvStorageFtwWorkingSize
+  gEfiMdeModulePkgTokenSpaceGuid.PcdFlashNvStorageFtwSpareSize
+
+[Ppis]
+  gArmMpCoreInfoPpiGuid
diff --git a/Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPi.c b/Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPi.c
new file mode 100644
index 000000000000..758ebda844ab
--- /dev/null
+++ b/Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPi.c
@@ -0,0 +1,99 @@
+/** @file
+ *
+ *  Copyright (c) 2014-2016, Linaro Limited. All rights reserved.
+ *  Copyright (c) 2014, Red Hat, Inc.
+ *  Copyright (c) 2011-2013, ARM Limited. All rights reserved.
+ *
+ *
+ *  This program and the accompanying materials
+ *  are licensed and made available under the terms and conditions of the BSD License
+ *  which accompanies this distribution.  The full text of the license may be found at
+ *  http://opensource.org/licenses/bsd-license.php
+ *
+ *  THE PROGRAM IS DISTRIBUTED UNDER THE BSD LICENSE ON AN "AS IS" BASIS,
+ *  WITHOUT WARRANTIES OR REPRESENTATIONS OF ANY KIND, EITHER EXPRESS OR IMPLIED.
+ *
+ **/
+
+#include <Library/IoLib.h>
+#include <Library/ArmPlatformLib.h>
+#include <Library/DebugLib.h>
+#include <Pi/PiBootMode.h>
+
+#include <Ppi/ArmMpCoreInfo.h>
+
+/**
+  Return the current Boot Mode
+
+  This function returns the boot reason on the platform
+
+  @return   Return the current Boot Mode of the platform
+
+**/
+EFI_BOOT_MODE
+ArmPlatformGetBootMode (
+  VOID
+  )
+{
+  return BOOT_WITH_FULL_CONFIGURATION;
+}
+
+/**
+  This function is called by PrePeiCore, in the SEC phase.
+**/
+RETURN_STATUS
+ArmPlatformInitialize (
+  IN  UINTN  MpId
+  )
+{
+  return RETURN_SUCCESS;
+}
+
+VOID
+ArmPlatformInitializeSystemMemory (
+  VOID
+  )
+{
+}
+
+STATIC ARM_CORE_INFO mRpi3InfoTable[] = {
+  { 0x0, 0x0, },             // Cluster 0, Core 0
+  { 0x0, 0x1, },             // Cluster 0, Core 1
+  { 0x0, 0x2, },             // Cluster 0, Core 2
+  { 0x0, 0x3, },             // Cluster 0, Core 3
+};
+
+STATIC
+EFI_STATUS
+PrePeiCoreGetMpCoreInfo (
+  OUT UINTN          *CoreCount,
+  OUT ARM_CORE_INFO  **ArmCoreTable
+  )
+{
+  // Only support one cluster
+  *CoreCount = sizeof (mRpi3InfoTable) / sizeof (ARM_CORE_INFO);
+  *ArmCoreTable = mRpi3InfoTable;
+
+  return EFI_SUCCESS;
+}
+
+STATIC ARM_MP_CORE_INFO_PPI mMpCoreInfoPpi = {
+  PrePeiCoreGetMpCoreInfo
+};
+STATIC EFI_PEI_PPI_DESCRIPTOR mPlatformPpiTable[] = {
+  {
+    EFI_PEI_PPI_DESCRIPTOR_PPI,
+    &gArmMpCoreInfoPpiGuid,
+    &mMpCoreInfoPpi
+  }
+};
+
+VOID
+ArmPlatformGetPlatformPpiList (
+  OUT UINTN                   *PpiListSize,
+  OUT EFI_PEI_PPI_DESCRIPTOR  **PpiList
+  )
+{
+  *PpiListSize = sizeof (mPlatformPpiTable);
+  *PpiList = mPlatformPpiTable;
+}
diff --git a/Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPiMem.c b/Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPiMem.c
new file mode 100644
index 000000000000..6d7c04498230
--- /dev/null
+++ b/Platform/RaspberryPi/RPi3/Library/PlatformLib/RaspberryPiMem.c
@@ -0,0 +1,160 @@
+/** @file
+ *
+ *  Copyright (c) 2017-2018, Andrey Warkentin <andrey.warkentin@gmail.com>
+ *  Copyright (c) 2014, Linaro Limited. All rights reserved.
+ *
+ *  This program and the accompanying materials
+ *  are licensed and made available under the terms and conditions of the BSD License
+ *  which accompanies this distribution.  The full text of the license may be found at
+ *  http://opensource.org/licenses/bsd-license.php
+ *
+ *  THE PROGRAM IS DISTRIBUTED UNDER THE BSD LICENSE ON AN "AS IS" BASIS,
+ *  WITHOUT WARRANTIES OR REPRESENTATIONS OF ANY KIND, EITHER EXPRESS OR IMPLIED.
+ *
+ **/
+
+#include <Library/ArmPlatformLib.h>
+#include <Library/DebugLib.h>
+#include <IndustryStandard/Bcm2836.h>
+#include <Library/PcdLib.h>
+
+extern UINT64 mSystemMemoryEnd;
+extern UINT64 mGPUMemoryBase;
+extern UINT64 mGPUMemoryLength;
+
+#define VariablesSize (FixedPcdGet32(PcdFlashNvStorageVariableSize) +   \
+                       FixedPcdGet32(PcdFlashNvStorageFtwWorkingSize) + \
+                       FixedPcdGet32(PcdFlashNvStorageFtwSpareSize) +  \
+                       FixedPcdGet32(PcdNvStorageEventLogSize))
+
+#define VariablesBase (FixedPcdGet64(PcdFdBaseAddress) + \
+                       FixedPcdGet32(PcdFdSize) - \
+                       VariablesSize)
+
+#define ATFBase (FixedPcdGet64(PcdFdBaseAddress) + FixedPcdGet32(PcdFdSize))
+
+STATIC ARM_MEMORY_REGION_DESCRIPTOR RaspberryPiMemoryRegionDescriptor[] = {
+  {
+    /* Firmware Volume. */
+    FixedPcdGet64 (PcdFdBaseAddress), FixedPcdGet64 (PcdFdBaseAddress),
+    FixedPcdGet32 (PcdFdSize) - VariablesSize,
+    ARM_MEMORY_REGION_ATTRIBUTE_WRITE_BACK
+  },
+  {
+    /* Variables Volume. */
+    VariablesBase, VariablesBase,
+    VariablesSize,
+    ARM_MEMORY_REGION_ATTRIBUTE_WRITE_BACK
+  },
+  {
+    /* ATF reserved RAM. */
+    ATFBase, ATFBase,
+    FixedPcdGet64 (PcdSystemMemoryBase) - ATFBase,
+    ARM_MEMORY_REGION_ATTRIBUTE_WRITE_BACK
+  },
+  {
+    /* System RAM. */
+    FixedPcdGet64 (PcdSystemMemoryBase), FixedPcdGet64 (PcdSystemMemoryBase),
+    0,
+    ARM_MEMORY_REGION_ATTRIBUTE_WRITE_BACK
+  },
+  {
+    /* Reserved GPU RAM. */
+    0,
+    0,
+    0,
+    ARM_MEMORY_REGION_ATTRIBUTE_DEVICE
+  },
+  {
+    /* SOC registers. */
+    BCM2836_SOC_REGISTERS,
+    BCM2836_SOC_REGISTERS,
+    BCM2836_SOC_REGISTER_LENGTH,
+    ARM_MEMORY_REGION_ATTRIBUTE_DEVICE
+  },
+  {
+  }
+};
+
+/**
+  Return the Virtual Memory Map of your platform
+
+  This Virtual Memory Map is used by MemoryInitPei Module to initialize the MMU
+  on your platform.
+
+  @param[out]   VirtualMemoryMap    Array of ARM_MEMORY_REGION_DESCRIPTOR
+                                    describing a Physical-to-Virtual Memory
+                                    mapping. This array must be ended by a
+                                    zero-filled entry
+
+**/
+VOID
+ArmPlatformGetVirtualMemoryMap (
+  IN ARM_MEMORY_REGION_DESCRIPTOR** VirtualMemoryMap
+  )
+{
+  RaspberryPiMemoryRegionDescriptor[3].Length = mSystemMemoryEnd + 1 -
+    FixedPcdGet64 (PcdSystemMemoryBase);
+
+  RaspberryPiMemoryRegionDescriptor[4].PhysicalBase =
+    RaspberryPiMemoryRegionDescriptor[3].PhysicalBase +
+    RaspberryPiMemoryRegionDescriptor[3].Length;
+
+  RaspberryPiMemoryRegionDescriptor[4].VirtualBase =
+    RaspberryPiMemoryRegionDescriptor[4].PhysicalBase;
+
+  RaspberryPiMemoryRegionDescriptor[4].Length =
+    RaspberryPiMemoryRegionDescriptor[5].PhysicalBase -
+    RaspberryPiMemoryRegionDescriptor[4].PhysicalBase;
+
+  DEBUG ((DEBUG_INFO, "FD:\n"
+    "\tPhysicalBase: 0x%lX\n"
+    "\tVirtualBase: 0x%lX\n"
+    "\tLength: 0x%lX\n",
+    RaspberryPiMemoryRegionDescriptor[0].PhysicalBase,
+    RaspberryPiMemoryRegionDescriptor[0].VirtualBase,
+    RaspberryPiMemoryRegionDescriptor[0].Length +
+    RaspberryPiMemoryRegionDescriptor[1].Length));
+
+  DEBUG ((DEBUG_INFO, "Variables (part of FD):\n"
+    "\tPhysicalBase: 0x%lX\n"
+    "\tVirtualBase: 0x%lX\n"
+    "\tLength: 0x%lX\n",
+    RaspberryPiMemoryRegionDescriptor[1].PhysicalBase,
+    RaspberryPiMemoryRegionDescriptor[1].VirtualBase,
+    RaspberryPiMemoryRegionDescriptor[1].Length));
+
+  DEBUG ((DEBUG_INFO, "ATF RAM:\n"
+    "\tPhysicalBase: 0x%lX\n"
+    "\tVirtualBase: 0x%lX\n"
+    "\tLength: 0x%lX\n",
+    RaspberryPiMemoryRegionDescriptor[2].PhysicalBase,
+    RaspberryPiMemoryRegionDescriptor[2].VirtualBase,
+    RaspberryPiMemoryRegionDescriptor[2].Length));
+
+  DEBUG ((DEBUG_INFO, "System RAM:\n"
+    "\tPhysicalBase: 0x%lX\n"
+    "\tVirtualBase: 0x%lX\n"
+    "\tLength: 0x%lX\n",
+    RaspberryPiMemoryRegionDescriptor[3].PhysicalBase,
+    RaspberryPiMemoryRegionDescriptor[3].VirtualBase,
+    RaspberryPiMemoryRegionDescriptor[3].Length));
+
+  DEBUG ((DEBUG_INFO, "GPU Reserved:\n"
+    "\tPhysicalBase: 0x%lX\n"
+    "\tVirtualBase: 0x%lX\n"
+    "\tLength: 0x%lX\n",
+    RaspberryPiMemoryRegionDescriptor[4].PhysicalBase,
+    RaspberryPiMemoryRegionDescriptor[4].VirtualBase,
+    RaspberryPiMemoryRegionDescriptor[4].Length));
+
+  DEBUG ((DEBUG_INFO, "SoC reserved:\n"
+    "\tPhysicalBase: 0x%lX\n"
+    "\tVirtualBase: 0x%lX\n"
+    "\tLength: 0x%lX\n",
+    RaspberryPiMemoryRegionDescriptor[5].PhysicalBase,
+    RaspberryPiMemoryRegionDescriptor[5].VirtualBase,
+    RaspberryPiMemoryRegionDescriptor[5].Length));
+
+  *VirtualMemoryMap = RaspberryPiMemoryRegionDescriptor;
+}
-- 
2.17.0.windows.1



  parent reply	other threads:[~2019-02-05 16:26 UTC|newest]

Thread overview: 34+ messages / expand[flat|nested]  mbox.gz  Atom feed  top
2019-02-05 16:25 [PATCH v5 edk2-platforms 00/22] Platform/RaspberryPi: Add Raspberry Pi 3 support Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 01/22] Silicon/Broadcom/Bcm283x: Add interrupt driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 02/22] Silicon/Broadcom/Bcm283x: Add GpioLib Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 03/22] Platform/RaspberryPi/RPi3: Add ACPI tables Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 04/22] Platform/RaspberryPi/RPi3: Add reset and memory init libraries Pete Batard
2019-02-05 16:25 ` Pete Batard [this message]
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 06/22] Platform/RaspberryPi/RPi3: Add firmware driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 07/22] Platform/RaspberryPi/RPi3: Add platform config driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 08/22] Platform/RaspberryPi/RPi3: Add SMBIOS driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 09/22] Platform/RaspberryPi/RPi3: Add display driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 10/22] Platform/RaspberryPi/RPi3: Add console driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 11/22] Platform/RaspberryPi/RPi3: Add NV storage driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 12/22] Platform/RaspberryPi/RPi3: Add Device Tree driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 13/22] Platform/RaspberryPi/RPi3: Add base MMC driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 14/22] Platform/RaspberryPi/RPi3: Add Arasan " Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 15/22] Platform/RaspberryPi/RPi3: Add SD Host driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 16/22] Platform/RaspberryPi/RPi3: Add platform boot manager and helper libs Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 17/22] Platform/RaspberryPi/RPi3: Add USB host driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 18/22] Platform/RaspberryPi/RPi3 *NON-OSI*: Add ATF binaries Pete Batard
2019-02-06 22:39   ` Kinney, Michael D
2019-02-07  0:52     ` Pete Batard
2019-02-07  2:35       ` Kinney, Michael D
2019-02-07 11:26         ` Pete Batard
2019-02-07 14:25           ` Ard Biesheuvel
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 19/22] Platform/RaspberryPi/RPi3 *NON-OSI*: Add Device Tree binaries Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 20/22] Platform/RaspberryPi/RPi3 *NON-OSI*: Add logo driver Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 21/22] Platform/RaspberryPi/RPi3: Add platform Pete Batard
2019-02-05 16:25 ` [PATCH v5 edk2-platforms 22/22] Platform/RaspberryPi/RPi3: Add platform readme's Pete Batard
2019-02-14 18:42   ` Leif Lindholm
2019-02-13  3:41 ` [PATCH v5 edk2-platforms 00/22] Platform/RaspberryPi: Add Raspberry Pi 3 support Jeremy Linton
2019-02-15 10:27   ` Ard Biesheuvel
2019-02-15 11:05     ` Ard Biesheuvel
2019-02-15 14:56       ` Pete Batard
2019-02-14 18:45 ` Leif Lindholm

Reply instructions:

You may reply publicly to this message via plain-text email
using any one of the following methods:

* Save the following mbox file, import it into your mail client,
  and reply-to-list from there: mbox

  Avoid top-posting and favor interleaved quoting:
  https://en.wikipedia.org/wiki/Posting_style#Interleaved_style

* Reply using the --to, --cc, and --in-reply-to
  switches of git-send-email(1):

  git send-email \
    --in-reply-to=20190205162537.6472-6-pete@akeo.ie \
    --to=devel@edk2.groups.io \
    /path/to/YOUR_REPLY

  https://kernel.org/pub/software/scm/git/docs/git-send-email.html

* If your mail client supports setting the In-Reply-To header
  via mailto: links, try the mailto: link
Be sure your reply has a Subject: header at the top and a blank line before the message body.
This is a public inbox, see mirroring instructions
for how to clone and mirror all data and code used for this inbox