#include <iostream>
#include <termios.h>
#include <unistd.h>
#include <map>
#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
Go to the source code of this file.
◆ getch()
◆ main()
| int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ print_message()
◆ print_vel()
| void print_vel |
( |
const geometry_msgs::Twist & |
vel | ) |
|
◆ moveBindings
| std::map<char, std::vector<float> > moveBindings |
Initial value:{
{'w', {0.5, 0, 0}},
{'x', {-0.5, 0, 0}},
{'a', {0, 0.5, 0}},
{'d', {0, -0.5, 0}},
{'s', {0, 0, 0}},
{'q', {0, 0, -0.5}},
{'e', {0, 0, 0.5}},
}
Definition at line 16 of file teleop.cpp.