#include <sstream>
#include <iostream>
#include <stdint.h>
#include <stdio.h>
#include <stdlib.h>
#include <fcntl.h>
#include <unistd.h>
#include <sys/ioctl.h>
#include <sys/time.h>
#include <sys/ipc.h>
#include <sys/types.h>
#include <sys/shm.h>
#include <linux/spi/spidev.h>
#include <ros/ros.h>
#include <ros/time.h>
#include <std_msgs/String.h>
#include <gumstix_memread_bma180/bma180meas.h>
#include <gumstix_memwrite_bma180/writermsg.h>
#include <errno.h>
Go to the source code of this file.
Defines | |
#define | NUM_SENSORS 8 |
#define | SHMSZ 30720000 |
#define | xSHMSZ 0x1D4C000 |
Functions | |
int | main (int argc, char **argv) |
void | msgCallback (const gumstix_memwrite_bma180::writermsg::ConstPtr &msg) |
Variables | |
bool | readit = false |
#define NUM_SENSORS 8 |
Definition at line 36 of file bma180-reader.cpp.
#define SHMSZ 30720000 |
Definition at line 34 of file bma180-reader.cpp.
#define xSHMSZ 0x1D4C000 |
Definition at line 35 of file bma180-reader.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 49 of file bma180-reader.cpp.
void msgCallback | ( | const gumstix_memwrite_bma180::writermsg::ConstPtr & | msg | ) |
Definition at line 39 of file bma180-reader.cpp.
bool readit = false |
Definition at line 37 of file bma180-reader.cpp.