#include <ros/ros.h>#include <geometry_msgs/Twist.h>#include <sensor_msgs/Imu.h>#include <nav_msgs/Odometry.h>#include <robotnik_msgs/set_odometry.h>#include <mavros_msgs/CommandLong.h>#include <robot_localization/SetPose.h>#include <std_srvs/Trigger.h>
Go to the source code of this file.
Classes | |
| class | LocalizationUtils |
Defines | |
| #define | MAVLINK_CALIBRATION_COMMAND 241 |
| To calibrate PIXHAWK sensors. | |
Functions | |
| int | main (int argc, char **argv) |
| #define MAVLINK_CALIBRATION_COMMAND 241 |
To calibrate PIXHAWK sensors.
To reset both the ekf_localization_node and the summit_xl_controller node
Definition at line 12 of file robot_localization_utils.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 243 of file robot_localization_utils.cpp.