$search
Collects sensor data and formats it for Matlab in topics, use -rostopic echo -p /matlab_footsens -rostopic echo -p /matlab_xsens. More...
#include <ros/console.h>#include <ros/ros.h>#include <nav_msgs/Odometry.h>#include <gazebo_msgs/ContactsState.h>#include "tulip_gazebo/xsens_state_message.h"#include "tulip_gazebo/footsens_state_message.h"#include "std_msgs/String.h"#include <cmath>#include <LinearMath/btQuaternion.h>#include <LinearMath/btMatrix3x3.h>#include <tf/transform_broadcaster.h>
Go to the source code of this file.
Classes | |
| struct | matlab_output_class::cnt_footsens_msg |
| class | matlab_output_class |
Defines | |
| #define | _USE_MATH_DEFINES |
Functions | |
| int | main (int argc, char **argv) |
Collects sensor data and formats it for Matlab in topics, use -rostopic echo -p /matlab_footsens -rostopic echo -p /matlab_xsens.
Definition in file matlab_output.cpp.
| #define _USE_MATH_DEFINES |
Definition at line 60 of file matlab_output.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 201 of file matlab_output.cpp.