UAV Dynamics class used for dynamics, IMU, and angular rate control simulation node. More...
#include <main.hpp>
Public Member Functions | |
int8_t | init () |
Uav_Dynamics (ros::NodeHandle nh) | |
Private Member Functions | |
void | calibrationCallback (std_msgs::UInt8 msg) |
int8_t | getParamsFromRos () |
int8_t | initCalibration () |
int8_t | initDynamicsSimulator () |
int8_t | initSensors () |
void | performLogging (double period) |
void | proceedDynamics (double period) |
void | publishToRos (double period) |
void | simulationLoopTimerCallback (const ros::WallTimerEvent &event) |
Main Simulator loop. More... | |
int8_t | startClockAndThreads () |
Private Attributes | |
Actuators | _actuators |
StateLogger | _logger |
ros::NodeHandle | _node |
RvizVisualizator | _rviz_visualizator |
ScenarioManager | _scenarioManager |
Sensors | _sensors |
std::vector< double > | _wind_ned {3} |
ros::Subscriber | calibrationSub_ |
UavDynamicsSimBase::SimMode_t | calibrationType_ {UavDynamicsSimBase::SimMode_t::NORMAL} |
ros::Publisher | clockPub_ |
double | clockScale_ = 1.0 |
ros::Time | currentTime_ |
std::thread | diagnosticTask |
double | dt_secs_ = 1.0f/960. |
uint64_t | dynamicsCounter_ |
DynamicsInfo | info |
std::vector< double > | initPose_ {7} |
std::thread | proceedDynamicsTask |
std::thread | publishToRosTask |
const float | ROS_PUB_PERIOD_SEC = 0.05f |
uint64_t | rosPubCounter_ |
ros::WallTimer | simulationLoopTimer_ |
std::shared_ptr< UavDynamicsSimBase > | uavDynamicsSim_ |
bool | useSimTime_ |
UAV Dynamics class used for dynamics, IMU, and angular rate control simulation node.
|
explicit |
|
private |
int8_t Uav_Dynamics::init | ( | ) |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |
|
private |