#include <ros/ros.h>#include <geometry_msgs/Twist.h>#include "sensor_msgs/JointState.h"#include "hebiros/FeedbackMsg.h"#include <ros/console.h>
Go to the source code of this file.
Functions | |
| void | feedback_callback (sensor_msgs::JointState data) |
| int | main (int argc, char **argv) |
Variables | |
| double | buffer = 0 |
| sensor_msgs::JointState | commands |
| sensor_msgs::JointState | feedback |
| bool | feedback_init = false |
| double | rate_of_command = 60 |
| void feedback_callback | ( | sensor_msgs::JointState | data | ) |
Definition at line 27 of file example_omnibase_odometry.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 34 of file example_omnibase_odometry.cpp.
| double buffer = 0 |
Definition at line 23 of file example_omnibase_odometry.cpp.
| sensor_msgs::JointState commands |
Definition at line 21 of file example_omnibase_odometry.cpp.
| sensor_msgs::JointState feedback |
Definition at line 20 of file example_omnibase_odometry.cpp.
| bool feedback_init = false |
Definition at line 24 of file example_omnibase_odometry.cpp.
| double rate_of_command = 60 |
Definition at line 22 of file example_omnibase_odometry.cpp.