Functions | Variables
teleop.cpp File Reference
#include <iostream>
#include <termios.h>
#include <unistd.h>
#include <map>
#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
Include dependency graph for teleop.cpp:

Go to the source code of this file.

Functions

int getch ()
 
int main (int argc, char **argv)
 
void print_message ()
 
void print_vel (const geometry_msgs::Twist &vel)
 

Variables

std::map< char, std::vector< float > > moveBindings
 

Function Documentation

◆ getch()

int getch ( )

Definition at line 44 of file teleop.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 77 of file teleop.cpp.

◆ print_message()

void print_message ( )

Definition at line 27 of file teleop.cpp.

◆ print_vel()

void print_vel ( const geometry_msgs::Twist &  vel)

Definition at line 72 of file teleop.cpp.

Variable Documentation

◆ 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.



omnibase_control
Author(s): Harshal Deshpande , Mihir Kulkarni
autogenerated on Mon Feb 28 2022 23:01:32