#include <fstream>#include <iostream>#include <Eigen/Geometry>#include <mav_msgs/conversions.h>#include <mav_msgs/default_topics.h>#include <mav_msgs/eigen_mav_msgs.h>#include <ros/ros.h>#include <sensor_msgs/Imu.h>#include <trajectory_msgs/MultiDOFJointTrajectory.h>
Go to the source code of this file.
Classes | |
| class | WaypointWithTime |
Functions | |
| void | callback (const sensor_msgs::ImuPtr &msg) |
| int | main (int argc, char **argv) |
Variables | |
| static const int64_t | kNanoSecondsInSecond = 1000000000 |
| bool | sim_running = false |
| void callback | ( | const sensor_msgs::ImuPtr & | msg | ) |
Definition at line 36 of file waypoint_publisher_file.cpp.
Definition at line 55 of file waypoint_publisher_file.cpp.
const int64_t kNanoSecondsInSecond = 1000000000 [static] |
Definition at line 34 of file waypoint_publisher_file.cpp.
| bool sim_running = false |
Definition at line 32 of file waypoint_publisher_file.cpp.