Questions tagged [python]
Python is a widely used high-level, general-purpose, interpreted, dynamic programming language.
993 questions
0
votes
0
answers
8
views
How can I get Message Info when subscribing in Python?
I want to subscribe to a topic in Python but the messages don't have headers with timestamps. My understanding is I can get a published timestamp from the message info but I can't figure out how to ...
0
votes
0
answers
14
views
Problems with moveit2 and cartesian path with pymoveit2
I made a Moveit config package with the setup assistant (ROS2 Humble). To control the robot, I'm programming a script with pymoveit2, and I can give successful commands to the arm.
The problem I have ...
0
votes
0
answers
17
views
Moveit Error : Planning plugin name is empty or not defined in namespace 'move_group'
I am trying to move the robot in webots through moveit. I have created planner.launch.py file which launches all the nodes along with moveit. When I run it I get planning pipeline not defined issue ...
0
votes
0
answers
14
views
Transformation Error When Mapping YOLO Object Detections
This follows up on my earlier question. I now have yolo_ros integrated with rosbot-autonomy and can verify that the object detection works through the below image feed from rviz simulation obtained ...
0
votes
0
answers
13
views
Error using ROS and moveit_py api to program UR10robot
I've installed ROS2 Jazzy and the UR_driver package to be able to program an UR10 robot motion through python. If I launch ur_moveit, I can plan and execute a movement on the UR10 robot through RVIZ, ...
0
votes
0
answers
12
views
Moveit path planning
I am working with a custom 3-DOF robot (2 revolute and 1 prismatic joint) and would like to use MoveIt for motion planning, obstacle detection, and Cartesian path computation. I created a MoveIt ...
0
votes
0
answers
14
views
ROS2 Jazzy MoveIT & Python - planning waypoint sequence
ive been trying to get moveit working with python for a while, and feel like Im mostly piecing together scraps of information, but perhaps I have missed a central source?
Essentially I am currently ...
0
votes
1
answer
17
views
Moveit assistant
I have a general question regarding MoveIt. I have a robot with 2 revolute joints and 1 prismatic joint. I used MoveIt Assistant to create a MoveIt package by uploading my URDF. Then, I wrote a custom ...
0
votes
0
answers
14
views
How to spawn a urdf model in a ros2 gazebo jetty world with a python launch file
I am trying to learn to spawn a urdf model in gazebo jetty with a ros2 launch file. and i am trying to figure it out on how to do it i can make the sdf world spawn but i cannot make the urdf spawn so ...
0
votes
0
answers
23
views
How to achieve smooth and very precise RCM-constrained motion?
EDIT: Sorry guys this is my first post of this nature so I messed it up, let me try to fix it.
I'm studying robotics and really like the control side of it.
I recently did my internship on Franka ...
0
votes
0
answers
31
views
Basic Pick and Place Simulation in Webots
I am trying to simulate a basic pick and place in webots and having a real hard time to use ikpy library. Has anyone done a basic pick and place in webots such as picking up a soda can? I am not using ...
0
votes
0
answers
24
views
learning to launch a sdf file with ros2 gazebo
i am trying to learn ros2 gazebo but when i tried to launch the pkg from the tutorial (link here https://gazebosim.org/docs/latest/ros2_launch_gazebo/ ) i only get the terminal working and not the ...
0
votes
0
answers
46
views
Robot does not move when using Nav2 in real world
I’m currently working on an autonomous navigation project using ROS 2 and Nav2. In simulation, several tests have been carried out, such as sending a goal with goal_pose, using actions like /...
0
votes
0
answers
43
views
Why might the code works for one bag, but not the other?
I’m working on a ROS 2 project that integrates YOLOPv2 for road detection and a BEV (Bird’s Eye View) transformation followed by costmap generation. The full image processing pipeline is:
...
0
votes
0
answers
44
views
ROS2 (Windows WSL) to DJI Tello communication
I want to create a swarm of DJI Tello EDU drones and have the logic for this running in ROS2 (Jazzy). I already created a simulation of this in ROS2 but on a linux terminal connected to virtual ...
0
votes
0
answers
63
views
ROS2: Planning file formats when using MoveItPy
Please can someone explain something to me on MoveIt2 (Jazzy)
I have fired many MoveIt2 arm demos up. These fire up Gazebo, Rviz2, Ros2 Control, MoveIt etc, and they use "Planning pipelines"...
0
votes
0
answers
30
views
Custom RRT-Connect with Cartesian Execution Works in Simulation, Fails on Real Doosan Arm
I'm using ROS (Noetic), MoveIt, and Python with a Doosan M0609 robot arm. I’ve implemented a custom RRT-Connect planner that samples reachable workspace points, checks IK and collisions for each node, ...
0
votes
1
answer
138
views
ROS 2 Humble: ros2 launch fails with KeyError: 'launch' and No module named 'launch.launch_description_sources'
I'm working with ROS 2 Humble on Ubuntu 22.04. When I attempt to use any ros2 launch command (e.g. ros2 launch my_package my_launch_file.launch.py), I get the following error:
...
0
votes
0
answers
57
views
Planning trajectory with waypoints using Python
is it possible to plan a trajectory with waypoints using PythonAPI?
Currently, I take one point from the trajectory, plan and execute the motion, then take the next point and repeat the process.
Can a ...
0
votes
0
answers
16
views
Import Conda Packages in a ROS2 project
Environment:
Ubuntu 20.04, ROS 2 Foxy Python3.8
My building command:
...
0
votes
1
answer
133
views
Didn't receive robot state (joint angles) with recent timestamp within 1.000000 seconds
I'm having an issue with fetching the current pose of the robot using the Piper ROS package (https://github.com/agilexrobotics/piper_ros/tree/humble). When trying to get the robot's current pose using ...
0
votes
1
answer
61
views
Running node with YAML file gives me error: rclpy._rclpy_pybind11.UnknownROSArgsError
I run a node from the terminal with --ros-args -p number:=7 -p timer_period:= 1.0 and all is working fine, but when I try to run the same node with a YAML file I get an error - "rclpy....
1
vote
0
answers
13
views
Error when passing arguments to launch file
I'm running into this issue where every time I run my launch file for sick_multiscan LiDAR:
...
1
vote
2
answers
59
views
How to install libboost to ROS2 Humble that was build from source
Problem
I cannot install libboost to ROS2 Humble that I build from source.
I am using cv_bridge in my rospackage, and it depends on libboost.
...
1
vote
1
answer
159
views
ros2 control topic remapping inconsistency
Issue
When bringing up my gazebo simulation, the specified topic remaps for my ros2 controllers are not consistently remapping. It seems to be a toss up as to when the topic gets remapped. I'll ...
1
vote
1
answer
105
views
How to Integrate pyrealsense2 (Python 3.10) with ROS2 Jazzy on Ubuntu 24.04 (Default Python 3.12)?
I’m looking for some help with a Python version mismatch in my ROS2 setup.
My system: Ubuntu 24.04 (dual boot).
ROS2 distro: Jazzy Jalisco (installed via system packages).
System Python: 3.12.3 (...
0
votes
1
answer
35
views
message_filters ApproximateTimeSynchronizer blocked by service callback
The ApproximateTimeSynchronizer subscriber callback is never called, can you please guide me on how to solve this problem? here is a minimal example to reproduce:
<...
0
votes
2
answers
119
views
Ros2 ament cmake python oserror [erno 8 ]
I am trying to learn ROS2 Jazzy ament cmake python to use C++ and Python in the package. I successfully build the package. C++ node runs okay but the Python node gives this error:
...
3
votes
0
answers
92
views
Why is there no "ament_python_simple" package that would simplify ament_python packages?
The current minimal ament_python package looks quite cumbersome and for novice users, it might look like a lot of stuff they don't understand.
Just to list a few:
the need for creating an empty file <...
2
votes
0
answers
34
views
ActionServer migration to ROS2
I want to migrate ActionServer from ROS1 to ROS2, however the Tutorial is minimal, can you please tell me how can I migrate the functionalities in the code below? thanks in advance.
...
0
votes
0
answers
47
views
Fusion of IMU and BLE AoA, position estimate is very bad, but why?
I have been working on an ESKF for some time now and unfortunately have not yet achieved good results. I wanted to ask the community for help and advice. My project is as follows: I have developed an ...
0
votes
1
answer
148
views
CONTROLLING 3-axis GIMBAL CAMERA IN GAZEBO
I'm using Gazebo with Ardupilot.
how to control gimbal camera manual or autonomously in Gazebo simulation?
Any guidance or advice would be greatly appreciated!
Thanks in advance for your help!
I ...
0
votes
1
answer
86
views
Installing sunfounder robot-hat does not work
I try to install sunfounder robot-hat from ubuntu server 20.04 LTS os (link here: https://docs.sunfounder.com/projects/robot-hat-v4/en/latest/ ) but when i type this command in the terminal:
...
0
votes
0
answers
10
views
in jetson xavier nx, use python3 command to execute a script and it didn't throw error. But in pycharm, execute the same code and it threw an error
I was trying to execute a python script in Jetson Xavier NX.My code is as follows
...
0
votes
1
answer
61
views
Message Package Not Detected (ROS2)
I have two packages, gps_driver and gps_msg.
Driver: gps_driver->gps_driver->python->gps_driver.py
Msg: gps_msg->msg->GpsMsg.msg
In the relevant package.xml, gps_msg is listed as a ...
0
votes
0
answers
31
views
How to use planner in MoveitGroup Python Interface
I'm currently working on the Franka Panda Robot and want to plan paths using MoveIt. I am programming using the MoveIt Python Interface.
First of all how do I configure which planner will be used? RRT ...
0
votes
1
answer
48
views
Publishing & Subscribing, but no output
I'm hoping that someone would be able to suggest a solution for why a functioning Topic (screenshot) is not generating data based on the script below?
At the bottom of the page I have listed my ...
0
votes
1
answer
55
views
Help regarding implementing Pseudo Inverse Jacobian Matrix for end effector coordinates x,z and theta
I am currently implementing a 4R 4-link 4DOF robot and I am currently writing a python code for it which calculates the joint angles based on the end effector coordinates $(x, z, \theta)$ using ROS ...
0
votes
1
answer
38
views
Using View Angle plugin and /gui/move_to/model service
When I do use gz service to send a message to /gui/move_to/model, it works just fine (following the example here). But when I ...
0
votes
1
answer
31
views
I get a warning everytime I try to build my worspace
I need your help!!!
I cloned a repo from github, but when I try to colcon build my worspace I get this warning:
UserWarning: Usage of dash-separated 'install-scripts' will not be supported in future ...
0
votes
1
answer
68
views
Can't use ros2 launch on a launch file I cloned from github
I need your help!!!
I recently cloned this repo from github: https://github.com/joshnewans/articubot_one.git
everytime I try to use" ros2 launch camera.launch.py"
I'm running linux 22.04 on ...
0
votes
2
answers
93
views
How to dig through the docs?
I'm working on learning Harmonic and using the transport messages in Python. I'm not integrating with ROS - this is just Python+Gazebo. I'd like to start and stop the simulation from Python.
I've ...
1
vote
0
answers
23
views
How to implement 2D end effector co-ordinates in the GUI using the specified URDF file? [closed]
recently I made a 4R URDF file, I need to use it as a planar manipulator. Hence, I made a GUI according to it, I have successfully implemented separate joint sliders for each joint, and I have set two ...
0
votes
1
answer
28
views
Mismatch md5sum checksum with compute_ik in Python
I'm implementing a unity ros project, I'm running the ROS Noetic with a UR10e robot. The project requires me to run the CHOMP planner. When I called the compute_ik service, I encounter the below error
...
0
votes
0
answers
43
views
Roboclaw instance has no attribute '_port'
I have some RoboClaw 2x30A Motor Controller I want to code from Raspberry Pi 4B with Ubuntu 24.04.1 LTS. I've downloaded the classes from the supplier (https://downloads.basicmicro.com/code/...
1
vote
0
answers
43
views
Gazebo headless rendering when running from python API
First of all, I apologize if my question is basic. I am a fairly new to gazebo and still learning. I couldn't find an answer in tutorials, docs, gazebo GitHub, this forum, gazebo answers/community or ...
0
votes
2
answers
162
views
ros2 run works ok but ros2 launch gives "executable not found on the libexec directory" error
The package is iiwa_arm_controller and the executable is end_effector_joint_trajectory
The package builds and I can run it using ...
0
votes
0
answers
18
views
Robocyl path following using costmap
I have to design a ROS node that receives a reference path toward a global goal position and generates command velocities to safely follow it while avoiding sensed obstacles. This can be achieved ...
0
votes
0
answers
9
views
How do you configure the python linter and autocompletition with catkin python packages in vscode?
I am having some trouble trying to configure pylint in vscode and the autocompletition tool. They both fail to detect python modules that are installed from another catkin package.
I have tried adding ...
1
vote
2
answers
211
views
Kalman filter implementation
I’m implementing an extended kalman filter in melodic ros using odometry to estimate and a gps to correct. I noticed that the robot in question already provides the estimation of its linear and ...