Skip to content

alstondu/tello_ros_gazebo

 
 

Repository files navigation

tello_ros

ROS Tello driver and gazebo

Run

Gazebo

roslaunch tello_driver indoor_slam_gazebo.launch
rosservice call /enable_motors "enable: true"
rosrun teleop_twist_keyboard teleop_twist_keyboard.py cmd_vel:=/cmd_vel
rosrun tello_autonomous circle.py

Tello

roslaunch tello_driver orb.launch
rosrun tello_autonomous circle.py

Emergency stop Code

rostopic pub /tello/stop std_msgs/Bool "data: false"

todo

  • Fix intrinsic and extrinsic parameters of camera
  • Fix scale
  • Show path plan
  • Add calibration pose

Reference

yuokamoto/ros_tello

appliedAI-Initiative/orb_slam_2_ros

dji-sdk/Tello-Python

About

Tello Simulation for Gazebo

Resources

License

Stars

Watchers

Forks

Releases

No releases published

Packages

No packages published

Languages

  • CMake 64.1%
  • Python 35.1%
  • Shell 0.8%