#include <ros/ros.h>#include <std_msgs/Float64.h>#include <stdio.h>#include <dynamixel_msgs/JointState.h>#include <cmath>
Go to the source code of this file.
Classes | |
| class | Dynamixel |
Functions | |
| int | main (int argc, char **argv) |
| void | obtainValues (const dynamixel_msgs::JointState &msg) |
| void | transfer (const std_msgs::Float64 &msg) |
Variables | |
| float | error = 1 |
| int | go = 0 |
| float | place |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 77 of file commander.cpp.
| void obtainValues | ( | const dynamixel_msgs::JointState & | msg | ) |
Definition at line 21 of file commander.cpp.
| void transfer | ( | const std_msgs::Float64 & | msg | ) |
Definition at line 70 of file commander.cpp.
| float error = 1 |
Definition at line 16 of file commander.cpp.
| int go = 0 |
Definition at line 17 of file commander.cpp.
| float place |
Definition at line 18 of file commander.cpp.