Everything about Drone
  • Drone (Dynamic Remotely Operated Navigation Equipment)
  • About Me
  • Types of Drones
  • Applications of Drone
  • Categories of Drones in India
  • Motor Configuration and Controls for Quadcopter
  • Assembling Pluto Drone
  • Dynamics of DRONEs
    • Force and Moments
    • Orientation and position
    • Moving in z, x & y direction
  • Sensors which are used on a Drone
  • Rules & Regulations
  • Testing & Executing codes
    • Acro Mode
    • Blow to Take Off
    • App Heading
    • Monitoring the Pressure Difference
    • Throw and Go
    • Flipping
  • Laser Cutting
  • Laser Cutting Procedure
  • 3D Printing Drone case
  • Table Tennis Game
  • ROS (Robotic Operating System)
    • ROS Master
    • ROS Nodes
    • ROS Topics
    • ROS Message
    • Workspace (catkin)
    • Examples
      • Creating ROS Workspace
      • Publisher in ROS
      • Subscriber in ROS
      • Testing Publisher and Subscriber nodes
      • Add two int in ROS
      • Building Nodes
      • Pluto Node
Powered by GitBook
On this page

Was this helpful?

  1. ROS (Robotic Operating System)
  2. Examples

Creating ROS Workspace

When we create workspace for ROS there will be three folders in it named devel, build and src, src(script) in this we have to include our scripts which in this case will be talker and listner

Following commands should be ran in the terminal for creating ros workspace

  • $ cd ~/catkin_ws

  • $ catkin_make

  • $ . ~/catkin_ws/devel/setup.bash

Following commands should be ran in the terminal for creating ros package

  • $ cd ~/catkin_ws/src

  • $ catkin_create_pkg beginner_tutorials std_msgs rospy roscpp

Following commands should be ran in the terminal for Building and Sourcing Package

  • $ cd ~/catkin_ws

  • $ catkin_make

  • $ . ~/catkin_ws/devel/setup.bash

PreviousExamplesNextPublisher in ROS

Last updated 5 years ago

Was this helpful?