#include <ardrone3_setting_callbacks.h>

Public Member Functions | |
| PilotingSettingsMaxTilt (ros::NodeHandle &priv_nh) | |
| void | Update (const ARCONTROLLER_DICTIONARY_ARG_t *arguments, const ::ros::Time &t) |
| void | UpdateBebopFromROS (const BebopArdrone3Config &config, const ARCONTROLLER_Device_t *bebop_ctrl_ptr_) |
Public Member Functions inherited from bebop_driver::cb::AbstractSetting | |
| AbstractSetting (eARCONTROLLER_DICTIONARY_KEY cmd_key, ros::NodeHandle &priv_nh) | |
| virtual | ~AbstractSetting () |
Public Member Functions inherited from bebop_driver::cb::AbstractCommand | |
| AbstractCommand (eARCONTROLLER_DICTIONARY_KEY cmd_key) | |
| eARCONTROLLER_DICTIONARY_KEY | GetCommandKey () const |
| virtual | ~AbstractCommand () |
Private Attributes | |
| bool | PilotingSettingsMaxTiltCurrent_bebop_sent_ |
| double | PilotingSettingsMaxTiltCurrent_bebop_value_ |
Additional Inherited Members | |
Protected Attributes inherited from bebop_driver::cb::AbstractSetting | |
| ros::NodeHandle | priv_nh_ |
Protected Attributes inherited from bebop_driver::cb::AbstractCommand | |
| ARCONTROLLER_DICTIONARY_ARG_t * | arg |
| eARCONTROLLER_DICTIONARY_KEY | cmd_key_ |
| mutable::boost::mutex | mutex_ |
Definition at line 126 of file ardrone3_setting_callbacks.h.
|
inlineexplicit |
Definition at line 133 of file ardrone3_setting_callbacks.h.
|
inlinevirtual |
Implements bebop_driver::cb::AbstractCommand.
Definition at line 172 of file ardrone3_setting_callbacks.h.
|
inlinevirtual |
Implements bebop_driver::cb::AbstractSetting.
Definition at line 139 of file ardrone3_setting_callbacks.h.
|
private |
Definition at line 130 of file ardrone3_setting_callbacks.h.
|
private |
Definition at line 129 of file ardrone3_setting_callbacks.h.