#include "ros/ros.h"#include "std_msgs/String.h"#include "ros_pololu_servo/MotorCommand.h"#include "geometry_msgs/Twist.h"#include <math.h>
Go to the source code of this file.
Functions | |
| void | cmdVelReceived (const geometry_msgs::Twist::ConstPtr &cmd_vel) |
| int | main (int argc, char **argv) |
Variables | |
| const float | head_offset = -90.0 |
| const float | PI = 3.14159 |
| float | smooth_angle [5] = {0} |
| float | vx = 0 |
| float | vy = 0 |
| int | zero_state_cnt = 0 |
| void cmdVelReceived | ( | const geometry_msgs::Twist::ConstPtr & | cmd_vel | ) |
Definition at line 14 of file forte_rc_head_control.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 21 of file forte_rc_head_control.cpp.
| const float head_offset = -90.0 |
Definition at line 12 of file forte_rc_head_control.cpp.
| const float PI = 3.14159 |
Definition at line 9 of file forte_rc_head_control.cpp.
| float smooth_angle[5] = {0} |
Definition at line 11 of file forte_rc_head_control.cpp.
| float vx = 0 |
Definition at line 7 of file forte_rc_head_control.cpp.
| float vy = 0 |
Definition at line 8 of file forte_rc_head_control.cpp.
| int zero_state_cnt = 0 |
Definition at line 10 of file forte_rc_head_control.cpp.