Functions
raw_data_subscriber.cpp File Reference
#include <ros/ros.h>
#include <geometry_msgs/QuaternionStamped.h>
#include <geometry_msgs/Vector3Stamped.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/MagneticField.h>
Include dependency graph for raw_data_subscriber.cpp:

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)
 

Function Documentation

◆ accCallback()

void accCallback ( const geometry_msgs::Vector3StampedConstPtr &  msg)

Definition at line 19 of file raw_data_subscriber.cpp.

◆ angVelCallback()

void angVelCallback ( const geometry_msgs::Vector3StampedConstPtr &  msg)

Definition at line 24 of file raw_data_subscriber.cpp.

◆ imuCallback()

void imuCallback ( const sensor_msgs::Imu::ConstPtr &  msg)

Subscriber callbacks

Definition at line 12 of file raw_data_subscriber.cpp.

◆ magCallback()

void magCallback ( const sensor_msgs::MagneticField::ConstPtr &  msg)

Definition at line 39 of file raw_data_subscriber.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Node main function

Definition at line 48 of file raw_data_subscriber.cpp.

◆ quatCallback()

void quatCallback ( const geometry_msgs::QuaternionStampedConstPtr &  msg)

Definition at line 29 of file raw_data_subscriber.cpp.

◆ rpyCallback()

void rpyCallback ( const geometry_msgs::Vector3StampedConstPtr &  msg)

Definition at line 34 of file raw_data_subscriber.cpp.



muse_v2_driver
Author(s): Elisa Tosello , Roberto Bortoletto
autogenerated on Thu Jan 20 2022 03:24:53