#include "tmc_coe_interpreter.h"#include "adi_tmc_coe/TmcCoeInfo.h"#include "geometry_msgs/Twist.h"#include "std_msgs/Int32.h"#include "std_msgs/String.h"

Go to the source code of this file.
Classes | |
| class | TmcCoeMotor |
Enumerations | |
| enum | mode_of_operation_t { NONE = 0, PROFILE_POSITION, PROFILE_VELOCITY = 3, HOMING_MODE = 6, CYCLIC_SYNC_POS = 8, CYCLIC_SYNC_VEL, CYCLIC_SYNC_TRQ } |
| enum | pos_control_word_t { ABSOLUTE_POSITION = 31, RELATIVE_POSITION = 95 } |
Variables | |
| const uint16_t | ANGULAR_FULL_ROTATION = 360 |
| const uint8_t | BLDC_MOTOR = 6 |
| const uint8_t | DEFAULT_RATE = 10 |
| const uint8_t | MAX_RATE = 100 |
| const double | PI = 3.1415926535 |
| const uint8_t | SECS_TO_MIN = 60 |
| enum mode_of_operation_t |
Copyright (c) 2023-2024 Analog Devices, Inc. All Rights Reserved. This software is proprietary to Analog Devices, Inc. and its licensors.
| Enumerator | |
|---|---|
| NONE | |
| PROFILE_POSITION | |
| PROFILE_VELOCITY | |
| HOMING_MODE | |
| CYCLIC_SYNC_POS | |
| CYCLIC_SYNC_VEL | |
| CYCLIC_SYNC_TRQ | |
Definition at line 16 of file tmc_coe_motor.h.
| enum pos_control_word_t |
| Enumerator | |
|---|---|
| ABSOLUTE_POSITION | |
| RELATIVE_POSITION | |
Definition at line 28 of file tmc_coe_motor.h.
| const uint16_t ANGULAR_FULL_ROTATION = 360 |
Definition at line 45 of file tmc_coe_motor.h.
| const uint8_t BLDC_MOTOR = 6 |
Definition at line 36 of file tmc_coe_motor.h.
| const uint8_t DEFAULT_RATE = 10 |
Definition at line 34 of file tmc_coe_motor.h.
| const uint8_t MAX_RATE = 100 |
Definition at line 35 of file tmc_coe_motor.h.
| const double PI = 3.1415926535 |
Definition at line 41 of file tmc_coe_motor.h.
| const uint8_t SECS_TO_MIN = 60 |
Definition at line 42 of file tmc_coe_motor.h.