#include <ros/ros.h>#include <std_msgs/Float64.h>#include <dynamixel_msgs/JointState.h>#include <cmath>#include <laser_assembler/AssembleScans.h>#include <ros/time.h>#include <std_msgs/Time.h>#include <std_msgs/Empty.h>
Go to the source code of this file.
Classes | |
| class | Dynamixel |
Functions | |
| void | initialize () |
| int | main (int argc, char **argv) |
| void | obtainValues (const dynamixel_msgs::JointState &msg) |
| void | sweep () |
Variables | |
| float | error |
| int | max_angle |
| int | min_angle |
| float | pause_time |
| void initialize | ( | ) |
Definition at line 90 of file tilt_motor_single_sweep_continuous.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 119 of file tilt_motor_single_sweep_continuous.cpp.
| void obtainValues | ( | const dynamixel_msgs::JointState & | msg | ) |
Definition at line 23 of file tilt_motor_single_sweep_continuous.cpp.
| void sweep | ( | ) |
Definition at line 100 of file tilt_motor_single_sweep_continuous.cpp.
| float error |
Definition at line 17 of file tilt_motor_single_sweep_continuous.cpp.
| int max_angle |
Definition at line 18 of file tilt_motor_single_sweep_continuous.cpp.
| int min_angle |
Definition at line 19 of file tilt_motor_single_sweep_continuous.cpp.
| float pause_time |
Definition at line 20 of file tilt_motor_single_sweep_continuous.cpp.