#include <gtest/gtest.h>#include <ros/ros.h>#include <ubiquity_motor/motor_hardware.h>#include <ubiquity_motor/motor_message.h>#include <limits>#include <util.h>
Go to the source code of this file.
Classes | |
| class | MotorHardwareTests |
Functions | |
| void | callbackS (const std_msgs::Int32 &data) |
| void | callbackU (const std_msgs::UInt32 &data) |
| int | main (int argc, char **argv) |
| TEST_F (MotorHardwareTests, writeSpeedsOutputs) | |
| TEST_F (MotorHardwareTests, nonZeroWriteSpeedsOutputs) | |
| TEST_F (MotorHardwareTests, odomUpdatesPosition) | |
| TEST_F (MotorHardwareTests, odomUpdatesPositionMax) | |
| TEST_F (MotorHardwareTests, requestVersionOutputs) | |
| TEST_F (MotorHardwareTests, oldFirmwareThrows) | |
| TEST_F (MotorHardwareTests, setDeadmanTimerOutputs) | |
| TEST_F (MotorHardwareTests, setParamsSendParams) | |
| TEST_F (MotorHardwareTests, debugRegisterUnsignedPublishes) | |
| TEST_F (MotorHardwareTests, debugRegisterSignedPublishes) | |
Variables | |
| static bool | called |
| void callbackS | ( | const std_msgs::Int32 & | data | ) |
Definition at line 302 of file motor_hardware_test.cc.
| void callbackU | ( | const std_msgs::UInt32 & | data | ) |
Definition at line 297 of file motor_hardware_test.cc.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 349 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| writeSpeedsOutputs | |||
| ) |
Definition at line 68 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| nonZeroWriteSpeedsOutputs | |||
| ) |
Definition at line 87 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| odomUpdatesPosition | |||
| ) |
Definition at line 114 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| odomUpdatesPositionMax | |||
| ) |
Definition at line 167 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| requestVersionOutputs | |||
| ) |
Definition at line 224 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| oldFirmwareThrows | |||
| ) |
Definition at line 242 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| setDeadmanTimerOutputs | |||
| ) |
Definition at line 255 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| setParamsSendParams | |||
| ) |
Definition at line 272 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| debugRegisterUnsignedPublishes | |||
| ) |
Definition at line 307 of file motor_hardware_test.cc.
| TEST_F | ( | MotorHardwareTests | , |
| debugRegisterSignedPublishes | |||
| ) |
Definition at line 328 of file motor_hardware_test.cc.
|
static |
Definition at line 295 of file motor_hardware_test.cc.