I am new to ROS. My goal is to implement a slam algorithm on a pioneer 3dx robot. Where can I find a package for the PIONEER p3dx robot for ros noetic? Any assistance is appreciated
I found a package for the aforementioned robot IN A git…
I simply need to simulate a revolute joint between a servo part and a beam part. The model was imported from Fusion360 using fusion2urdf plugin on github.
model simulates fine on launching but when controller node is launched to control angle of…
I am trying to build a 4 wheel differential drive robot. But i am getting error when using ros2_control.
I am getting the following error "No parameter file provided. Configuration might be wrong. failed to parse input yaml file(s)" in terminal. …
import os
from ament_index_python.packages import get_package_share_directory
from launch import LaunchDescription
from launch.substitutions import LaunchConfiguration, Command
from launch.actions import DeclareLaunchArgument
from…
I have been searching for a solution to my problem but am unable to find any solutions for my problem that are also using Python. I am trying to run Universal Robot's UR10e in gazebo and control it using ROS2_control.
I am running ROS2 Iron and…
So I'm working with ROS2 on my MacBook air M1 and need gazebo for simulations. The OS I'm working with is Ubuntu 22.04 ARM on Parallels Desktop 18. I'm running ros2 Humble, and its gazebo counterpart Gazebo Gardens. Rviz is running just fine, but…
I found this code in blog about OpenCV and i rewrite for using ROS gazebo simulation. I got many error about marker`finding. I will add the error below.
#!/usr/bin/env python3
# -*- coding: utf-8 -*-
from imutils import paths
import numpy as…
In my project, have an urdf file of a robotic arm as well as of a mobile platform. I am able to spawn them together in Gazebo simulation.
I now want to use moveit to control both of them. For this I opened the MoveIt Setup Assitant and was able to…
I have a project, in which I want to include two models a mir (https://github.com/DFKI-NI/mir_robot) and a ur10 (https://github.com/ros-industrial/universal_robot).
My goal is, to fixate the ur10 on top of the mir.
What I have done so far:
Opened…
I am following ROS2 example for robotic arm.
The arm has couple of parts, represented by STL.
Now, when I use the STL file that comes with the example, the arm is perfectly aligned.
But when I use Tinkercad (tinkercad.com), which is probably the…
I use mac os m1. I installed anaconda and I create an envoirement ROS. I installed ROS, and gazebo was installed ROS. so I did not do anything to install gazebo. because after ros installing gazebo is ready. I want to use ardupilot_gazebo. and I…
I am working with the c++ gazebo transport library (Ros2 Galactic, Gazebo 11 classic). I was confused as to why
gazebo::transport::NodePtr gives the error
namespace "gazebo::transport" has no member "NodePtr"C/C++(135)
I traced the error to…
I am trying to install gym_gazebo on my Ubuntu 18.04 LTS system according to https://github.com/erlerobot/gym-gazebo
Everything is getting installed correctly, however, while trying to run python
circuit2_turtlebot_lidar_qlearn.py
, I get error…
i am new to pybullet and wanted to simulate a UR5 bot doing ultrasound on humans. For that i've loaded a ur5 bot and a soccerball{example for human) , i want the end effector to apply a constant 2N force on the surface of the Soccer while moving and…
I'm trying to simulate a stackingbox with some elements and create a PointCloud with the kinect camera and now im trying to label these points with the ids of the elements with an rayshape
The cam is at "0.0 0.0 1.9 0.0 1.5707963267948966 0.0" so i…