-
geometry_msgs::PoseStamped vision;
int main(int argc, char **argv)
{
ros::init(argc, argv, "uwb");
ros::NodeHandle nh("~");
ros::Publisher vision_pub = nh.advertise("/mavros/vision_pose/pose",…
-
`ThreePointMsg.msg` used in `global_planner/path_handler_node` seems to be doing something [quite similar](https://github.com/PX4/avoidance/blob/master/global_planner/src/nodes/path_handler_node.cpp#L…
-
I'm currently trying to control my virtual drone (which run by "make px4_sitl_default gazebo" )
I'm succeed on this, so I could see drone takes command like "commander takeoff"
but I'm failing …
-
I run the `rosrun mavros px4.launch` on my laptop with Ubuntu 12.04 - ROS hydro and it works perfect and I can see the msgs with `rostopic echo /mavros/data/imu` but when I try to run it on a robot wi…
-
I am running sitl_gazebo simulation with mavros. I am using my own script for a simple mission using waypoints. I am able to run the simulation correctly, but unable to plot /mavros/local_position/pos…
-
Hi @Jaeyoung-Lim
On launching a ```catkin build```, an error related to a header file in trajectory_msgs pops up. I checked the common_msgs/trajectory_msgs, there is not ```MultiDOFJointTrajectory…
-
**Describe the bug**
Multi-UAV SITL Simulation with IRIS works fine. But I think there is a problem for the standard plane.
**To Reproduce**
Steps to reproduce the behavior:
1. Set up SITL with…
-
Hello.
Issue is offboard control is not working with this simple cpp. **Copter fly FAR MORE higher than setpoint**.
This cpp works well in Gazebo,and virtual copter keeps at 0.5m. ok.
But in my real …
-
**Bug Report**
My system setting as follows:
- Flight controller: Pixhawk 1
- PX4 firmware: 1.7.3 (installed from qgroundcontroll)
- Onboard Computer: Raspberry Pi 3 installing: Ubuntu Mate + Ros …
-
I'm using Ubuntu16.04
Firmware 1.8.2
Gazebo 8.6
I have finished tutorial1 and the vehicle flyt well.
But when I'm running roslaunch px4 sfm.launch. The /mavros/state is not connected.
Could anyon…