Open Cristian-wp opened 4 years ago
but when I use ~imu/atm_pressure (sensor_msgs/FluidPressure)
In https://github.com/mavlink/mavros/blob/master/mavros/src/plugins/imu.cpp only ~imu/static_pressure and ~imu/diff_pressure are listed. The wiki ros documentation is not always up-to-date and most of the time it is easier to look in the source code directly and see which topics are created.
@vooon please help
Hello, I am trying to get the complete set of parameters that I can see in QGC in the parameter
HIGRES_IMU
. I know that most of these parameters are insideimu_pub topics
so I have tried to use them. For what concern~imu/data (sensor_msgs/Imu)
all works perfectly, but when I use~imu/atm_pressure (sensor_msgs/FluidPressure)
the topic do not start and no values are displayed. I know that the sensor work because it change correctly in QGC. If I plot the connection with rqt_graph I can see the topic imu/data, but not the pressure one.When I do roslaunch I can not see the parameter loaded, so I think that is the problem, but I do not understand how to add it.
I thinks I have to modify px4_config.yaml, but how?
The same problem is for mavros/global_position/rel_alt. Can someone help me with this problem(if is possible step by step)? If there is even another solution without Mavros it will be ok, but I need a tutorial about it, because I am not so expert in this field :( Thank you in advance.
Cristian
MAVROS version and platform
Mavros: 1.1.0 ROS: Melodic Ubuntu: 18.04
Autopilot type and version
[ ] ArduPilot [ x ] PX4
Version: 1.10
Node logs
Diagnostics
Check ID
My program