h4r_x52_joyext
LED and MFD Control for Saitek X52 Pro
 All Classes Files Functions Variables Enumerator Macros Pages
X52_JoyExt Class Reference

#include <x52_joyext.h>

Collaboration diagram for X52_JoyExt:
Collaboration graph

Public Member Functions

 X52_JoyExt (ros::NodeHandle &n)
 
virtual ~X52_JoyExt ()
 
void send_to_joystick ()
 

Private Member Functions

void setLEDs (uint8_t inValue, uint8_t *red, uint8_t *green, bool *update)
 
void cb_leds (const h4r_x52_joyext::x52_led_colorConstPtr &msg)
 
void cb_mfd_text (const h4r_x52_joyext::x52_mfdConstPtr &msg)
 
void cb_date (const h4r_x52_joyext::x52_dateConstPtr &msg)
 
void cb_time (const h4r_x52_joyext::x52_timeConstPtr &msg)
 
void cb_brighnessMFD (const std_msgs::UInt8ConstPtr &msg)
 
void cb_brighnessLED (const std_msgs::UInt8ConstPtr &msg)
 

Private Attributes

ros::NodeHandle & nh
 
ros::Rate * loop_rate
 
bool updateLED [10]
 
bool updateLED_b
 
bool updateMFD [3]
 
bool updateMFD_b
 
bool updateDate
 
bool updateTime
 
bool updateOffset [2]
 
bool updateBrightnessMFD
 
bool updateBrightnessLED
 
uint8_t LED [19]
 
std::string mfd_content [3]
 
uint8_t Date [3]
 
uint8_t Time_24
 
uint8_t Time [2]
 
uint8_t Offset [2]
 
uint8_t Offset_24 [2]
 
uint8_t Offset_Inv [2]
 
uint8_t brightnessMFD
 
uint8_t brightnessLED
 
ros::Subscriber subleds
 
ros::Subscriber submfd_text
 
ros::Subscriber subdate
 
ros::Subscriber subtime
 
ros::Subscriber subbrightnessMFD
 
ros::Subscriber subbrightnessLED
 

Detailed Description

Definition at line 44 of file x52_joyext.h.

Constructor & Destructor Documentation

X52_JoyExt::~X52_JoyExt ( )
virtual

Definition at line 64 of file x52_joyext.cpp.

References loop_rate.

Member Function Documentation

void X52_JoyExt::cb_brighnessLED ( const std_msgs::UInt8ConstPtr &  msg)
private

Definition at line 179 of file x52_joyext.cpp.

References brightnessLED, and updateBrightnessLED.

Referenced by X52_JoyExt().

Here is the caller graph for this function:

void X52_JoyExt::cb_brighnessMFD ( const std_msgs::UInt8ConstPtr &  msg)
private

Definition at line 173 of file x52_joyext.cpp.

References brightnessMFD, and updateBrightnessMFD.

Referenced by X52_JoyExt().

Here is the caller graph for this function:

void X52_JoyExt::cb_date ( const h4r_x52_joyext::x52_dateConstPtr &  msg)
private

Definition at line 138 of file x52_joyext.cpp.

References Date, and updateDate.

Referenced by X52_JoyExt().

Here is the caller graph for this function:

void X52_JoyExt::cb_leds ( const h4r_x52_joyext::x52_led_colorConstPtr &  msg)
private

Definition at line 69 of file x52_joyext.cpp.

References LED, setLEDs(), and updateLED.

Referenced by X52_JoyExt().

Here is the call graph for this function:

Here is the caller graph for this function:

void X52_JoyExt::cb_mfd_text ( const h4r_x52_joyext::x52_mfdConstPtr &  msg)
private

Definition at line 90 of file x52_joyext.cpp.

References mfd_content, and updateMFD.

Referenced by X52_JoyExt().

Here is the caller graph for this function:

void X52_JoyExt::cb_time ( const h4r_x52_joyext::x52_timeConstPtr &  msg)
private

Definition at line 146 of file x52_joyext.cpp.

References Offset, Offset_24, Offset_Inv, Time, Time_24, updateOffset, and updateTime.

Referenced by X52_JoyExt().

Here is the caller graph for this function:

void X52_JoyExt::send_to_joystick ( )
void X52_JoyExt::setLEDs ( uint8_t  inValue,
uint8_t *  red,
uint8_t *  green,
bool *  update 
)
inlineprivate

Definition at line 80 of file x52_joyext.h.

Referenced by cb_leds().

Here is the caller graph for this function:

Member Data Documentation

uint8_t X52_JoyExt::brightnessLED
private

Definition at line 70 of file x52_joyext.h.

Referenced by cb_brighnessLED(), send_to_joystick(), and X52_JoyExt().

uint8_t X52_JoyExt::brightnessMFD
private

Definition at line 69 of file x52_joyext.h.

Referenced by cb_brighnessMFD(), send_to_joystick(), and X52_JoyExt().

uint8_t X52_JoyExt::Date[3]
private

Definition at line 63 of file x52_joyext.h.

Referenced by cb_date(), send_to_joystick(), and X52_JoyExt().

uint8_t X52_JoyExt::LED[19]
private

Definition at line 61 of file x52_joyext.h.

Referenced by cb_leds(), send_to_joystick(), and X52_JoyExt().

ros::Rate* X52_JoyExt::loop_rate
private

Definition at line 47 of file x52_joyext.h.

Referenced by send_to_joystick(), X52_JoyExt(), and ~X52_JoyExt().

std::string X52_JoyExt::mfd_content[3]
private

Definition at line 62 of file x52_joyext.h.

Referenced by cb_mfd_text(), send_to_joystick(), and X52_JoyExt().

ros::NodeHandle& X52_JoyExt::nh
private

Definition at line 46 of file x52_joyext.h.

Referenced by X52_JoyExt().

uint8_t X52_JoyExt::Offset[2]
private

Definition at line 66 of file x52_joyext.h.

Referenced by cb_time(), send_to_joystick(), and X52_JoyExt().

uint8_t X52_JoyExt::Offset_24[2]
private

Definition at line 67 of file x52_joyext.h.

Referenced by cb_time(), and send_to_joystick().

uint8_t X52_JoyExt::Offset_Inv[2]
private

Definition at line 68 of file x52_joyext.h.

Referenced by cb_time(), and send_to_joystick().

ros::Subscriber X52_JoyExt::subbrightnessLED
private

Definition at line 78 of file x52_joyext.h.

Referenced by X52_JoyExt().

ros::Subscriber X52_JoyExt::subbrightnessMFD
private

Definition at line 77 of file x52_joyext.h.

Referenced by X52_JoyExt().

ros::Subscriber X52_JoyExt::subdate
private

Definition at line 75 of file x52_joyext.h.

Referenced by X52_JoyExt().

ros::Subscriber X52_JoyExt::subleds
private

Definition at line 73 of file x52_joyext.h.

Referenced by X52_JoyExt().

ros::Subscriber X52_JoyExt::submfd_text
private

Definition at line 74 of file x52_joyext.h.

Referenced by X52_JoyExt().

ros::Subscriber X52_JoyExt::subtime
private

Definition at line 76 of file x52_joyext.h.

Referenced by X52_JoyExt().

uint8_t X52_JoyExt::Time[2]
private

Definition at line 65 of file x52_joyext.h.

Referenced by cb_time(), send_to_joystick(), and X52_JoyExt().

uint8_t X52_JoyExt::Time_24
private

Definition at line 64 of file x52_joyext.h.

Referenced by cb_time(), and send_to_joystick().

bool X52_JoyExt::updateBrightnessLED
private

Definition at line 58 of file x52_joyext.h.

Referenced by cb_brighnessLED(), send_to_joystick(), and X52_JoyExt().

bool X52_JoyExt::updateBrightnessMFD
private

Definition at line 57 of file x52_joyext.h.

Referenced by cb_brighnessMFD(), send_to_joystick(), and X52_JoyExt().

bool X52_JoyExt::updateDate
private

Definition at line 54 of file x52_joyext.h.

Referenced by cb_date(), send_to_joystick(), and X52_JoyExt().

bool X52_JoyExt::updateLED[10]
private

Definition at line 50 of file x52_joyext.h.

Referenced by cb_leds(), send_to_joystick(), and X52_JoyExt().

bool X52_JoyExt::updateLED_b
private

Definition at line 51 of file x52_joyext.h.

Referenced by X52_JoyExt().

bool X52_JoyExt::updateMFD[3]
private

Definition at line 52 of file x52_joyext.h.

Referenced by cb_mfd_text(), send_to_joystick(), and X52_JoyExt().

bool X52_JoyExt::updateMFD_b
private

Definition at line 53 of file x52_joyext.h.

bool X52_JoyExt::updateOffset[2]
private

Definition at line 56 of file x52_joyext.h.

Referenced by cb_time(), send_to_joystick(), and X52_JoyExt().

bool X52_JoyExt::updateTime
private

Definition at line 55 of file x52_joyext.h.

Referenced by cb_time(), send_to_joystick(), and X52_JoyExt().


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