#include <ros/ros.h>
#include <geometry_msgs/QuaternionStamped.h>
#include <geometry_msgs/Vector3Stamped.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/MagneticField.h>
Go to the source code of this file.
Functions | |
void | accCallback (const geometry_msgs::Vector3StampedConstPtr &msg) |
void | angVelCallback (const geometry_msgs::Vector3StampedConstPtr &msg) |
void | imuCallback (const sensor_msgs::Imu::ConstPtr &msg) |
void | magCallback (const sensor_msgs::MagneticField::ConstPtr &msg) |
int | main (int argc, char **argv) |
void | quatCallback (const geometry_msgs::QuaternionStampedConstPtr &msg) |
void | rpyCallback (const geometry_msgs::Vector3StampedConstPtr &msg) |
void accCallback | ( | const geometry_msgs::Vector3StampedConstPtr & | msg | ) |
Definition at line 19 of file raw_data_subscriber.cpp.
void angVelCallback | ( | const geometry_msgs::Vector3StampedConstPtr & | msg | ) |
Definition at line 24 of file raw_data_subscriber.cpp.
void imuCallback | ( | const sensor_msgs::Imu::ConstPtr & | msg | ) |
Subscriber callbacks
Definition at line 12 of file raw_data_subscriber.cpp.
void magCallback | ( | const sensor_msgs::MagneticField::ConstPtr & | msg | ) |
Definition at line 39 of file raw_data_subscriber.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Node main function
Definition at line 48 of file raw_data_subscriber.cpp.
void quatCallback | ( | const geometry_msgs::QuaternionStampedConstPtr & | msg | ) |
Definition at line 29 of file raw_data_subscriber.cpp.
void rpyCallback | ( | const geometry_msgs::Vector3StampedConstPtr & | msg | ) |
Definition at line 34 of file raw_data_subscriber.cpp.