Classes | Public Member Functions | Public Attributes | Protected Types | Protected Attributes | Static Protected Attributes | List of all members
robot_hardware::UpperController Class Reference

#include <seed_r7_upper_controller.h>

Classes

struct  RobotStatus
 

Public Member Functions

void checkRobotStatus ()
 
std::string getFirmwareVersion ()
 
void getPosition ()
 
void remapAeroToRos (std::vector< int16_t > &_ros, std::vector< int16_t > &_aero)
 
void remapRosToAero (std::vector< int16_t > &_aero, std::vector< int16_t > &_ros)
 
void runScript (uint8_t _number, uint16_t _script)
 
void sendPosition (uint16_t _time, std::vector< int16_t > &_data)
 
void setCurrent (uint8_t _number, uint8_t _max, uint8_t _down)
 
 UpperController (const std::string &_port)
 
 ~UpperController ()
 

Public Attributes

std::vector< int > aero_index_
 
std::vector< std::pair< int, std::string > > aero_table_
 
bool comm_err_
 
bool is_open_
 
std::vector< std::string > name_
 
std::vector< int16_t > raw_data_
 
struct robot_hardware::UpperController::RobotStatus robot_status_
 

Protected Types

enum  error_bit_t {
  can2_connection = 0, can2_calibration = 1, can2_motor_status = 2, can2_temperature = 3,
  can2_response = 4, can2_step_out = 5, can2_protective_stopped = 6, can2_power = 7,
  can1_connection = 8, can1_calibration = 9, can1_motor_status = 10, can1_temperature = 11,
  can1_response = 12, can1_step_out = 13, can1_protective_stopped = 14, can1_power = 15
}
 

Protected Attributes

aero::controller::AeroCommandupper_
 

Static Protected Attributes

static const uint32_t BAUDRATE = 1000000
 

Detailed Description

Definition at line 11 of file seed_r7_upper_controller.h.

Member Enumeration Documentation

Enumerator
can2_connection 
can2_calibration 
can2_motor_status 
can2_temperature 
can2_response 
can2_step_out 
can2_protective_stopped 
can2_power 
can1_connection 
can1_calibration 
can1_motor_status 
can1_temperature 
can1_response 
can1_step_out 
can1_protective_stopped 
can1_power 

Definition at line 49 of file seed_r7_upper_controller.h.

Constructor & Destructor Documentation

robot_hardware::UpperController::UpperController ( const std::string &  _port)

Definition at line 4 of file seed_r7_upper_controller.cpp.

robot_hardware::UpperController::~UpperController ( )

Definition at line 34 of file seed_r7_upper_controller.cpp.

Member Function Documentation

void robot_hardware::UpperController::checkRobotStatus ( )

Definition at line 89 of file seed_r7_upper_controller.cpp.

std::string robot_hardware::UpperController::getFirmwareVersion ( )

Definition at line 83 of file seed_r7_upper_controller.cpp.

void robot_hardware::UpperController::getPosition ( )

Definition at line 39 of file seed_r7_upper_controller.cpp.

void robot_hardware::UpperController::remapAeroToRos ( std::vector< int16_t > &  _ros,
std::vector< int16_t > &  _aero 
)

Definition at line 55 of file seed_r7_upper_controller.cpp.

void robot_hardware::UpperController::remapRosToAero ( std::vector< int16_t > &  _aero,
std::vector< int16_t > &  _ros 
)

Definition at line 65 of file seed_r7_upper_controller.cpp.

void robot_hardware::UpperController::runScript ( uint8_t  _number,
uint16_t  _script 
)

Definition at line 78 of file seed_r7_upper_controller.cpp.

void robot_hardware::UpperController::sendPosition ( uint16_t  _time,
std::vector< int16_t > &  _data 
)

Definition at line 46 of file seed_r7_upper_controller.cpp.

void robot_hardware::UpperController::setCurrent ( uint8_t  _number,
uint8_t  _max,
uint8_t  _down 
)

Definition at line 73 of file seed_r7_upper_controller.cpp.

Member Data Documentation

std::vector<int> robot_hardware::UpperController::aero_index_

Definition at line 30 of file seed_r7_upper_controller.h.

std::vector<std::pair<int,std::string> > robot_hardware::UpperController::aero_table_

Definition at line 31 of file seed_r7_upper_controller.h.

const uint32_t robot_hardware::UpperController::BAUDRATE = 1000000
staticprotected

Definition at line 47 of file seed_r7_upper_controller.h.

bool robot_hardware::UpperController::comm_err_

Definition at line 33 of file seed_r7_upper_controller.h.

bool robot_hardware::UpperController::is_open_

Definition at line 26 of file seed_r7_upper_controller.h.

std::vector<std::string> robot_hardware::UpperController::name_

Definition at line 29 of file seed_r7_upper_controller.h.

std::vector<int16_t> robot_hardware::UpperController::raw_data_

Definition at line 27 of file seed_r7_upper_controller.h.

struct robot_hardware::UpperController::RobotStatus robot_hardware::UpperController::robot_status_
aero::controller::AeroCommand* robot_hardware::UpperController::upper_
protected

Definition at line 46 of file seed_r7_upper_controller.h.


The documentation for this class was generated from the following files:


seed_r7_ros_controller
Author(s): Yohei Kakiuchi
autogenerated on Sun Apr 18 2021 02:40:34