#include <ros/ros.h>
#include <string>
#include <boost/algorithm/string.hpp>
#include <clover/SetLEDEffect.h>
#include <led_msgs/SetLEDs.h>
#include <led_msgs/LEDState.h>
#include <led_msgs/LEDStateArray.h>
#include <sensor_msgs/BatteryState.h>
#include <mavros_msgs/State.h>
#include <rosgraph_msgs/Log.h>
Go to the source code of this file.
◆ callSetLeds()
◆ fill()
      
        
          | void fill | ( | uint8_t | r, | 
        
          |  |  | uint8_t | g, | 
        
          |  |  | uint8_t | b | 
        
          |  | ) |  |  | 
      
 
 
◆ handleBattery()
      
        
          | void handleBattery | ( | const sensor_msgs::BatteryState & | msg | ) |  | 
      
 
 
◆ handleLog()
      
        
          | void handleLog | ( | const rosgraph_msgs::Log & | log | ) |  | 
      
 
 
◆ handleMavrosState()
      
        
          | void handleMavrosState | ( | const mavros_msgs::State & | msg | ) |  | 
      
 
 
◆ handleState()
      
        
          | void handleState | ( | const led_msgs::LEDStateArray & | msg | ) |  | 
      
 
 
◆ main()
      
        
          | int main | ( | int | argc, | 
        
          |  |  | char ** | argv | 
        
          |  | ) |  |  | 
      
 
 
◆ notify()
      
        
          | void notify | ( | const std::string & | event | ) |  | 
      
 
 
◆ proceed()
◆ rainbow()
      
        
          | void rainbow | ( | uint8_t | n, | 
        
          |  |  | uint8_t & | r, | 
        
          |  |  | uint8_t & | g, | 
        
          |  |  | uint8_t & | b | 
        
          |  | ) |  |  | 
      
 
 
◆ setEffect()
      
        
          | bool setEffect | ( | clover::SetLEDEffect::Request & | req, | 
        
          |  |  | clover::SetLEDEffect::Response & | res | 
        
          |  | ) |  |  | 
      
 
 
◆ blink_fast_rate
◆ blink_rate
◆ blink_state
◆ counter
◆ current_effect
      
        
          | clover::SetLEDEffect::Request current_effect | 
      
 
 
◆ fade_period
◆ flash_delay
◆ led_count
◆ low_battery_threshold
      
        
          | double low_battery_threshold | 
      
 
 
◆ mavros_state
      
        
          | mavros_msgs::State mavros_state | 
      
 
 
◆ rainbow_period
◆ set_leds
      
        
          | led_msgs::SetLEDs set_leds | 
      
 
 
◆ set_leds_srv
◆ start_state
      
        
          | led_msgs::LEDStateArray start_state | 
      
 
 
◆ start_time
◆ state
      
        
          | led_msgs::LEDStateArray state | 
      
 
 
◆ timer
◆ wipe_period