All Projects → pantor → Ros Control Center

pantor / Ros Control Center

Licence: bsd-3-clause
A web-based control center for ROS robots.

Programming Languages

typescript
32286 projects

Projects that are alternatives of or similar to Ros Control Center

Se2clam
SE(2)-Constrained Localization and Mapping by Fusing Odometry and Vision (IEEE Transactions on Cybernetics 2019)
Stars: ✭ 116 (-35.56%)
Mutual labels:  robotics, ros
Xpp
Visualization of Motions for Legged Robots in ros-rviz
Stars: ✭ 177 (-1.67%)
Mutual labels:  robotics, ros
Ros2learn
ROS 2 enabled Machine Learning algorithms
Stars: ✭ 119 (-33.89%)
Mutual labels:  robotics, ros
Awesome Robotic Tooling
Tooling for professional robotic development in C++ and Python with a touch of ROS, autonomous driving and aerospace.
Stars: ✭ 1,876 (+942.22%)
Mutual labels:  robotics, ros
Rosnodejs
Client library for writing ROS nodes in JavaScript with nodejs
Stars: ✭ 145 (-19.44%)
Mutual labels:  robotics, ros
Stereo dense reconstruction
Dense 3D reconstruction from stereo (using LIBELAS)
Stars: ✭ 113 (-37.22%)
Mutual labels:  robotics, ros
Rclnodejs
Node.js version of ROS 2.0 client
Stars: ✭ 126 (-30%)
Mutual labels:  robotics, ros
Flexbe behavior engine
Contains the behavior engine FlexBE.
Stars: ✭ 101 (-43.89%)
Mutual labels:  robotics, ros
Weloveinterns
中科院软件所智能软件中心实习生社区
Stars: ✭ 143 (-20.56%)
Mutual labels:  robotics, ros
Aikido
Artificial Intelligence for Kinematics, Dynamics, and Optimization
Stars: ✭ 133 (-26.11%)
Mutual labels:  robotics, ros
Robotics setup
Setup Ubuntu 18.04, 16.04 and 14.04 with machine learning and robotics software plus user configuration. Includes ceres tensorflow ros caffe vrep eigen cudnn and cuda plus many more.
Stars: ✭ 110 (-38.89%)
Mutual labels:  robotics, ros
Urdf Viz
visualize URDF/XACRO file, URDF Viewer works on Windows/MacOS/Linux
Stars: ✭ 149 (-17.22%)
Mutual labels:  robotics, ros
Robotics Coursework
🤖 Places where you can learn robotics (and stuff like that) online 🤖
Stars: ✭ 1,810 (+905.56%)
Mutual labels:  robotics, ros
Dolly
🤖🐑 It's a sheep, it's a dolly, it's a following robot. Dolly was born to be cloned.
Stars: ✭ 113 (-37.22%)
Mutual labels:  robotics, ros
Grl
Robotics tools in C++11. Implements soft real time arm drivers for Kuka LBR iiwa plus V-REP, ROS, Constrained Optimization based planning, Hand Eye Calibration and Inverse Kinematics integration.
Stars: ✭ 105 (-41.67%)
Mutual labels:  robotics, ros
Cleanit
Open-source Autonomy Software in Rust-lang with gRPC for the Roomba series robot vacuum cleaners. Under development.
Stars: ✭ 125 (-30.56%)
Mutual labels:  robotics, ros
Webots
Webots Robot Simulator
Stars: ✭ 1,324 (+635.56%)
Mutual labels:  robotics, ros
Evo
Python package for the evaluation of odometry and SLAM
Stars: ✭ 1,373 (+662.78%)
Mutual labels:  robotics, ros
Urdf Loaders
URDF Loaders for Unity and THREE.js with example ATHLETE URDF Files
Stars: ✭ 129 (-28.33%)
Mutual labels:  robotics, ros
Roslibpy
Python ROS Bridge library
Stars: ✭ 146 (-18.89%)
Mutual labels:  robotics, ros

ROS Control Center

This control center is a universal tool for controlling robots running ROS. It runs in the browser using a websocket connection and roslibjs from RobotWebTools.

screenshot

In general, ROS Control Center offers an easy way to

  • show nodes, topics and service names.
  • subscribe and publish messages.
  • call services.
  • show and change parameters.

Further features like a console (rosout by default) output, a battery status view, a camera stream view or an advanced mode for better usability are implemented. Check it out!

Installation

On your ROS robot, the rosbridge_suite from Robot Web Tools needs to run. So to use the control center with your existing project, call roslaunch rosbridge_server rosbridge_websocket.launch to launch the websocket server. The control center runs on any computer (in particular without ROS...) in the same network. Open the ROS Control Center at https://pantor.github.io/ros-control-center. In the settings tab, you need to enter the IP address and port of your robot. Open the Control tab and reload.

Features

You can have multiple saved settings for quick changes and several robots.

ROS Control Center supports images and camera streams via the web_video_server package. If camera and camera info messages are published according to the web_video_server standards, the stream is shown with the settings.

For your own custom message and service types, you can download this repository and start a server via http-server in the console. Then, navigate to index.html in a browser. You can add individual html templates into the app/topics/ or app/services/ folder. The path of your file must correspond to the ROS service or message type name. See the included ROS common messages and standard services as an examples. In your html file, you can write AngularJS code for additional customizing and formatting.

The right sidebar shows a logger output (rosout by default). On the left, group names are shown. ROS topics, services and parameters can be grouped together for a better overview. This works as follows:

  • Every topic, service or parameter name should correspond to /group-name/element-name like a URL. Global parameters should have no group name and are shown below the group list on the left side.
  • Every element name should start with a capital letter, as they are shown in the normal view mode. All elements (including the lowercase-names from system services, topics and parameters) can be shown by enabling the advanced view mode.

In the right bottom corner, a battery status bar can be shown; the battery topic can be adapted in the settings tab.

Contributing

For development, Node.js needs to be installed. Via npm install it will automatically download all development dependencies (from package.json). Type npm start in the terminal for a live development server. With vagrant ssh and roslaunch ros_test_project main.launch, you can start a test project in a virtual ubuntu machine.

ROS Control Center depends on:

Contributions are always welcome!

License

ROS Control Center is released with a BSD license. For full terms and conditions, see the LICENSE file.

Contributors

See here for a full list of contributors.

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].