Namespaces | Classes | Enumerations | Functions | Variables
dataspeed_ulc_can Namespace Reference

Namespaces

 speed
 

Classes

class  ModuleVersion
 
struct  MsgUlcCfg
 
struct  MsgUlcCmd
 
struct  MsgUlcReport
 
struct  MsgVersion
 
class  PlatformMap
 
class  PlatformVersion
 
class  UlcNode
 
class  UlcNodelet
 

Enumerations

enum  { ID_ULC_CMD = 0x076, ID_ULC_CONFIG = 0x077, ID_ULC_REPORT = 0x078, ID_VERSION = 0x07F }
 
enum  Module {
  M_BPEC = 1, M_TPEC = 2, M_STEER = 3, M_SHIFT = 4,
  M_ABS = 5, M_BOO = 6, M_EPS = 7
}
 
enum  Platform {
  P_FORD_CD4 = 0x00, P_FORD_P5 = 0x01, P_FORD_C1 = 0x02, P_FORD_T6 = 0x03,
  P_FORD_U6 = 0x04, P_FORD_CD5 = 0x05, P_FORD_GE1 = 0x06, P_FCA_RU = 0x10,
  P_FCA_WK2 = 0x11, P_POLARIS_GEM = 0x80, P_POLARIS_RZR = 0x81
}
 

Functions

static void dispatchAssertSizes ()
 
template<typename T >
static void getParamWithSaturation (ros::NodeHandle &nh, const std::string &key, T &value, T min, T max)
 
static const char * moduleToString (Module x)
 
static bool operator!= (const PlatformVersion &x, const PlatformMap &map)
 
static bool operator!= (const PlatformVersion &x, const ModuleVersion &y)
 
static bool operator< (const PlatformVersion &x, const PlatformMap &map)
 
static bool operator< (const PlatformVersion &x, const ModuleVersion &y)
 
static bool operator<= (const PlatformVersion &x, const PlatformMap &map)
 
static bool operator<= (const PlatformVersion &x, const ModuleVersion &y)
 
static bool operator== (const PlatformVersion &x, const PlatformMap &map)
 
static bool operator== (const PlatformVersion &x, const ModuleVersion &y)
 
static bool operator> (const PlatformVersion &x, const PlatformMap &map)
 
static bool operator> (const PlatformVersion &x, const ModuleVersion &y)
 
static bool operator>= (const PlatformVersion &x, const PlatformMap &map)
 
static bool operator>= (const PlatformVersion &x, const ModuleVersion &y)
 
template<class T >
static T overflowSaturation (double input, T limit_min, T limit_max, double scale_factor, const std::string &input_name, const std::string &units)
 
static const char * platformToString (Platform x)
 
static bool validInputs (const dataspeed_ulc_msgs::UlcCmd &cmd)
 

Variables

PlatformMap OLD_ULC_FIRMWARE ({ {PlatformVersion(P_FCA_RU, M_STEER, ModuleVersion(1, 5, 2))}, {PlatformVersion(P_FCA_WK2, M_STEER, ModuleVersion(1, 3, 2))}, {PlatformVersion(P_FORD_C1, M_STEER, ModuleVersion(1, 2, 2))}, {PlatformVersion(P_FORD_CD4, M_STEER, ModuleVersion(2, 5, 2))}, {PlatformVersion(P_FORD_CD5, M_STEER, ModuleVersion(1, 1, 2))}, {PlatformVersion(P_FORD_GE1, M_STEER, ModuleVersion(0, 1, 0))}, {PlatformVersion(P_FORD_P5, M_STEER, ModuleVersion(1, 4, 2))}, {PlatformVersion(P_FORD_T6, M_STEER, ModuleVersion(0, 2, 2))}, {PlatformVersion(P_FORD_U6, M_STEER, ModuleVersion(1, 0, 2))}, {PlatformVersion(P_POLARIS_GEM, M_STEER, ModuleVersion(1, 1, 1))}, {PlatformVersion(P_POLARIS_RZR, M_STEER, ModuleVersion(0, 3, 1))}, })
 

Enumeration Type Documentation

◆ anonymous enum

anonymous enum
Enumerator
ID_ULC_CMD 
ID_ULC_CONFIG 
ID_ULC_REPORT 
ID_VERSION 

Definition at line 108 of file dispatch.h.

◆ Module

Enumerator
M_BPEC 
M_TPEC 
M_STEER 
M_SHIFT 
M_ABS 
M_BOO 
M_EPS 

Definition at line 60 of file PlatformVersion.h.

◆ Platform

Enumerator
P_FORD_CD4 
P_FORD_P5 
P_FORD_C1 
P_FORD_T6 
P_FORD_U6 
P_FORD_CD5 
P_FORD_GE1 
P_FCA_RU 
P_FCA_WK2 
P_POLARIS_GEM 
P_POLARIS_RZR 

Definition at line 45 of file PlatformVersion.h.

Function Documentation

◆ dispatchAssertSizes()

static void dataspeed_ulc_can::dispatchAssertSizes ( )
static

Definition at line 100 of file dispatch.h.

◆ getParamWithSaturation()

template<typename T >
static void dataspeed_ulc_can::getParamWithSaturation ( ros::NodeHandle nh,
const std::string &  key,
T &  value,
min,
max 
)
static

Definition at line 42 of file UlcNode.cpp.

◆ moduleToString()

static const char* dataspeed_ulc_can::moduleToString ( Module  x)
static

Definition at line 87 of file PlatformVersion.h.

◆ operator!=() [1/2]

static bool dataspeed_ulc_can::operator!= ( const PlatformVersion x,
const PlatformMap map 
)
static

Definition at line 114 of file PlatformMap.h.

◆ operator!=() [2/2]

static bool dataspeed_ulc_can::operator!= ( const PlatformVersion x,
const ModuleVersion y 
)
static

Definition at line 119 of file PlatformVersion.h.

◆ operator<() [1/2]

static bool dataspeed_ulc_can::operator< ( const PlatformVersion x,
const PlatformMap map 
)
static

Definition at line 109 of file PlatformMap.h.

◆ operator<() [2/2]

static bool dataspeed_ulc_can::operator< ( const PlatformVersion x,
const ModuleVersion y 
)
static

Definition at line 114 of file PlatformVersion.h.

◆ operator<=() [1/2]

static bool dataspeed_ulc_can::operator<= ( const PlatformVersion x,
const PlatformMap map 
)
static

Definition at line 111 of file PlatformMap.h.

◆ operator<=() [2/2]

static bool dataspeed_ulc_can::operator<= ( const PlatformVersion x,
const ModuleVersion y 
)
static

Definition at line 116 of file PlatformVersion.h.

◆ operator==() [1/2]

static bool dataspeed_ulc_can::operator== ( const PlatformVersion x,
const PlatformMap map 
)
static

Definition at line 113 of file PlatformMap.h.

◆ operator==() [2/2]

static bool dataspeed_ulc_can::operator== ( const PlatformVersion x,
const ModuleVersion y 
)
static

Definition at line 118 of file PlatformVersion.h.

◆ operator>() [1/2]

static bool dataspeed_ulc_can::operator> ( const PlatformVersion x,
const PlatformMap map 
)
static

Definition at line 110 of file PlatformMap.h.

◆ operator>() [2/2]

static bool dataspeed_ulc_can::operator> ( const PlatformVersion x,
const ModuleVersion y 
)
static

Definition at line 115 of file PlatformVersion.h.

◆ operator>=() [1/2]

static bool dataspeed_ulc_can::operator>= ( const PlatformVersion x,
const PlatformMap map 
)
static

Definition at line 112 of file PlatformMap.h.

◆ operator>=() [2/2]

static bool dataspeed_ulc_can::operator>= ( const PlatformVersion x,
const ModuleVersion y 
)
static

Definition at line 117 of file PlatformVersion.h.

◆ overflowSaturation()

template<class T >
static T dataspeed_ulc_can::overflowSaturation ( double  input,
limit_min,
limit_max,
double  scale_factor,
const std::string &  input_name,
const std::string &  units 
)
static

Definition at line 56 of file UlcNode.cpp.

◆ platformToString()

static const char* dataspeed_ulc_can::platformToString ( Platform  x)
static

Definition at line 70 of file PlatformVersion.h.

◆ validInputs()

static bool dataspeed_ulc_can::validInputs ( const dataspeed_ulc_msgs::UlcCmd &  cmd)
inlinestatic

Definition at line 69 of file UlcNode.cpp.

Variable Documentation

◆ OLD_ULC_FIRMWARE



dataspeed_ulc_can
Author(s): Micho Radovnikovich
autogenerated on Fri Dec 2 2022 03:20:37