| Public Member Functions | |
| ImuSim () | |
| void | onAcc (const typename geometry_msgs::Vector3::ConstPtr &msg) | 
| void | onOdom (const typename nav_msgs::Odometry::ConstPtr &msg) | 
| Private Attributes | |
| ros::Subscriber | acc | 
| boost::mutex | acc_mux | 
| tf2_ros::TransformBroadcaster | broadcaster | 
| ros::Publisher | depth_pub | 
| ros::Publisher | imu_pub | 
| geometry_msgs::Vector3 | nuacc | 
| ros::Subscriber | odom | 
Definition at line 48 of file ImuSim.cpp.
| ImuSim::ImuSim | ( | ) |  [inline] | 
Definition at line 50 of file ImuSim.cpp.
| void ImuSim::onAcc | ( | const typename geometry_msgs::Vector3::ConstPtr & | msg | ) |  [inline] | 
Definition at line 93 of file ImuSim.cpp.
| void ImuSim::onOdom | ( | const typename nav_msgs::Odometry::ConstPtr & | msg | ) |  [inline] | 
Definition at line 60 of file ImuSim.cpp.
| ros::Subscriber ImuSim::acc  [private] | 
Definition at line 100 of file ImuSim.cpp.
| boost::mutex ImuSim::acc_mux  [private] | 
Definition at line 102 of file ImuSim.cpp.
Definition at line 104 of file ImuSim.cpp.
| ros::Publisher ImuSim::depth_pub  [private] | 
Definition at line 101 of file ImuSim.cpp.
| ros::Publisher ImuSim::imu_pub  [private] | 
Definition at line 101 of file ImuSim.cpp.
| geometry_msgs::Vector3 ImuSim::nuacc  [private] | 
Definition at line 103 of file ImuSim.cpp.
| ros::Subscriber ImuSim::odom  [private] | 
Definition at line 100 of file ImuSim.cpp.