Stufin
Home Quick Cart Profile

Ublox Neo 6M GPS Module With EEPROM

Buy Now

Supply Voltage

3.3 V

Power Consumption

20 mA (typical)

Interface Options

UART, SPI, I2C

Baud Rate

Up to 115200 bps

EEPROM Capacity

2 KB

Operating Temperature

-40C to +85C

Storage Temperature

-40C to +85C

Weight

2.5 g

Dimensions

15 mm x 15 mm

Certifications and Compliance

The Ublox Neo 6M GPS Module with EEPROM complies with the following regulations and certifications

RoHS (Restriction of Hazardous Substances) compliant

CE (Conformit Europene) certified

FCC (Federal Communications Commission) certified

Ordering Information

The Ublox Neo 6M GPS Module with EEPROM is available in a variety of packaging options, including a 15 mm x 15 mm LCC (Leadless Chip Carrier) package. For ordering information, please contact the manufacturer or authorized distributor.

Pin Configuration

  • Ublox Neo 6M GPS Module With EEPROM Pinout Explanation
  • The Ublox Neo 6M GPS module with EEPROM is a compact and high-performance GPS receiver module that provides accurate positioning, velocity, and time information. The module has 16 pins, which are explained below:
  • Pin 1: VCC
  • Function: Power supply pin for the module
  • Voltage: 3.3V (typical) or 2.7V to 3.6V (recommended operating range)
  • Description: This pin should be connected to a 3.3V power source. It is recommended to use a voltage regulator or a power supply with a low dropout voltage to ensure stable operation.
  • Pin 2: GND
  • Function: Ground pin for the module
  • Description: This pin should be connected to the ground of the system.
  • Pin 3: TX (Transmit)
  • Function: Serial data transmission pin
  • Description: This pin transmits serial data from the GPS module to the host system. It is a digital output and should be connected to a serial receiver or a microcontroller's RX pin.
  • Pin 4: RX (Receive)
  • Function: Serial data reception pin
  • Description: This pin receives serial data from the host system and sends it to the GPS module. It is a digital input and should be connected to a serial transmitter or a microcontroller's TX pin.
  • Pin 5: PPST (Pulse Per Second)
  • Function: Pulse per second output pin
  • Description: This pin generates a 1Hz pulse signal, which can be used to synchronize the system clock with the GPS time.
  • Pin 6: NC (Not Connected)
  • Function: No internal connection
  • Description: This pin is not connected to any internal component and should be left floating.
  • Pin 7: EEPROM (SDA)
  • Function: I2C data pin for EEPROM access
  • Description: This pin is used for I2C communication with the onboard EEPROM. It is a bidirectional pin and should be connected to a microcontroller's I2C data pin (SDA).
  • Pin 8: EEPROM (SCL)
  • Function: I2C clock pin for EEPROM access
  • Description: This pin is used for I2C communication with the onboard EEPROM. It is a clock input pin and should be connected to a microcontroller's I2C clock pin (SCL).
  • Pin 9: ANT (Antenna)
  • Function: RF antenna connection pin
  • Description: This pin should be connected to a GPS antenna to receive satellite signals.
  • Pin 10: NC (Not Connected)
  • Function: No internal connection
  • Description: This pin is not connected to any internal component and should be left floating.
  • Pin 11: Vin
  • Function: Optional external voltage input pin
  • Description: This pin can be used to supply an external voltage to the module, bypassing the internal voltage regulator. If not used, this pin should be left floating.
  • Pin 12: EN (Enable)
  • Function: Module enable pin
  • Description: This pin is used to enable or disable the module. A high logic level (>2.5V) enables the module, while a low logic level (<0.5V) disables it.
  • Pin 13: RST (Reset)
  • Function: Reset pin
  • Description: This pin is used to reset the module. A low logic level (<0.5V) for at least 100ms resets the module.
  • Pin 14: INT (Interrupt)
  • Function: Interrupt pin
  • Description: This pin is used to generate interrupts for events such as new data availability or errors.
  • Pin 15: NC (Not Connected)
  • Function: No internal connection
  • Description: This pin is not connected to any internal component and should be left floating.
  • Pin 16: NC (Not Connected)
  • Function: No internal connection
  • Description: This pin is not connected to any internal component and should be left floating.
  • Connection Structure:
  • When connecting the Ublox Neo 6M GPS module with EEPROM, ensure the following:
  • Use a breadboard or a PCB with a 16-pin header to connect the module.
  • Connect VCC (Pin 1) to a 3.3V power source.
  • Connect GND (Pin 2) to the system ground.
  • Connect TX (Pin 3) to a serial receiver or a microcontroller's RX pin.
  • Connect RX (Pin 4) to a serial transmitter or a microcontroller's TX pin.
  • Connect PPST (Pin 5) to a pulse detection circuit or a microcontroller's input pin (if required).
  • Leave Pins 6, 10, 15, and 16 floating or unconnected.
  • Connect EEPROM (SDA, Pin 7) and EEPROM (SCL, Pin 8) to a microcontroller's I2C pins (SDA and SCL) for EEPROM access.
  • Connect ANT (Pin 9) to a GPS antenna.
  • Connect Vin (Pin 11) to an external voltage source (if required).
  • Connect EN (Pin 12) to a digital output pin of a microcontroller or a logic level shifter.
  • Connect RST (Pin 13) to a digital output pin of a microcontroller or a logic level shifter.
  • Connect INT (Pin 14) to a digital input pin of a microcontroller or a logic level shifter.
  • Remember to follow proper electrical connections, layout, and signal integrity guidelines when connecting the Ublox Neo 6M GPS module with EEPROM to ensure reliable operation.

Code Examples

Ublox Neo 6M GPS Module with EEPROM Documentation
Overview
The Ublox Neo 6M GPS module is a compact and high-performance GPS receiver module that provides accurate location information. It features a built-in EEPROM for storing configuration data and comes with a variety of interfaces, including UART, SPI, and I2C. This module is suitable for a wide range of applications, including robotics, autonomous vehicles, and IoT projects.
Technical Specifications
GPS Receiver: Ublox NEO-6M
 EEPROM: 2KB (512 bytes x 4 pages)
 Interfaces: UART, SPI, I2C
 GPS Frequencies: L1, C/A Code
 Accuracy: 2.5m CEP (Circular Error Probable)
 Power Consumption: 100mA (max)
 Operating Temperature: -40C to 85C
Connection Diagram
The Ublox Neo 6M GPS module has the following pins:
VCC: Power supply (3.3V or 5V)
 GND: Ground
 TX: UART transmit pin
 RX: UART receive pin
 SCL: I2C clock pin
 SDA: I2C data pin
 SCK: SPI clock pin
 MOSI: SPI master out slave in pin
 MISO: SPI master in slave out pin
 CS: SPI chip select pin
Example 1: Using the Ublox Neo 6M with an Arduino Uno
In this example, we will use the Ublox Neo 6M GPS module with an Arduino Uno to read GPS data.
Hardware Requirements
Arduino Uno
 Ublox Neo 6M GPS module
 Breadboard and jumper wires
Software Requirements
Arduino IDE (version 1.8.x or later)
 Ublox NEO-6M library for Arduino (available on GitHub)
Code Example
```cpp
#include <SoftwareSerial.h>
#include <TinyGPS++.h>
// Define the UART pins for the GPS module
#define GPS_TX 3
#define GPS_RX 4
// Create a SoftwareSerial object for the GPS module
SoftwareSerial gpsSerial(GPS_TX, GPS_RX);
// Create a TinyGPS++ object
TinyGPSPlus gps;
void setup() {
  Serial.begin(9600);
  gpsSerial.begin(9600);
}
void loop() {
  while (gpsSerial.available() > 0) {
    char c = gpsSerial.read();
    Serial.write(c);
    if (gps.encode(c)) {
      if (gps.location.isValid()) {
        Serial.print("Latitude: ");
        Serial.println(gps.location.lat(), 6);
        Serial.print("Longitude: ");
        Serial.println(gps.location.lng(), 6);
      }
    }
  }
}
```
Example 2: Using the Ublox Neo 6M with Raspberry Pi (Python)
In this example, we will use the Ublox Neo 6M GPS module with a Raspberry Pi to read GPS data using Python.
Hardware Requirements
Raspberry Pi (any model)
 Ublox Neo 6M GPS module
 Breadboard and jumper wires
Software Requirements
Raspbian OS (latest version)
 Python 3.x (installed on Raspbian)
Code Example
```python
import serial
import time
# Open the serial port for the GPS module
gps_serial = serial.Serial('/dev/ttyUSB0', 9600, timeout=1)
while True:
    # Read data from the GPS module
    data = gps_serial.readline().decode('utf-8')
# Parse the GPS data using the pynmea2 library
    from pynmea2 import parse
    msg = parse(data)
# Print the GPS data
    if msg:
        print("Latitude: ", msg.latitude)
        print("Longitude: ", msg.longitude)
        print("Altitude: ", msg.altitude)
        print("Satellites: ", msg.num_sats)
time.sleep(1)
```
Note: Make sure to install the necessary libraries and configure the serial port according to your system's requirements.
Example 3: Reading EEPROM Data using I2C (Arduino)
In this example, we will use the Ublox Neo 6M GPS module's EEPROM to store and read data using the I2C interface.
Hardware Requirements
Arduino Uno
 Ublox Neo 6M GPS module
 Breadboard and jumper wires
Software Requirements
Arduino IDE (version 1.8.x or later)
Code Example
```cpp
#include <Wire.h>
// Define the I2C address of the Ublox Neo 6M's EEPROM
#define EEPROM_I2C_ADDRESS 0x50
void setup() {
  Wire.begin();
  Serial.begin(9600);
}
void loop() {
  // Write data to the EEPROM
  byte data[] = {0x01, 0x02, 0x03, 0x04};
  Wire.beginTransmission(EEPROM_I2C_ADDRESS);
  Wire.write(data, 4);
  Wire.endTransmission();
delay(100);
// Read data from the EEPROM
  byte recvData[4];
  Wire.beginTransmission(EEPROM_I2C_ADDRESS);
  Wire.write(0x00); // Start address
  Wire.endTransmission();
  Wire.requestFrom(EEPROM_I2C_ADDRESS, 4);
  for (int i = 0; i < 4; i++) {
    recvData[i] = Wire.read();
  }
Serial.print("EEPROM Data: ");
  for (int i = 0; i < 4; i++) {
    Serial.print(recvData[i], HEX);
    Serial.print(" ");
  }
  Serial.println();
}
```
These code examples demonstrate how to use the Ublox Neo 6M GPS module in various contexts, including reading GPS data, storing and reading EEPROM data, and communicating with other microcontrollers.