ros-industrial / industrial_training

ROS-Industrial Training Material
https://industrial-training-master.readthedocs.io
Apache License 2.0
421 stars 237 forks source link

Any Plan with motion planning with C++ ROS Kinetic #341

Closed kappa95 closed 3 years ago

kappa95 commented 3 years ago

Hi I am following your tutorials and everything worked till Exercise 4.0 for motion planning with C++. It doesn't find any plans for any possible motion providing Pose or PoseStamped messages Instead If i move joints positions works. Some suggestion? I missed something?

marip8 commented 3 years ago

I would suggest checking your code against the files for the solution to the exercise here. My guess is that there is a small discrepancy between your code and the working solution that is causing this issue. If so, we could look into the wording of exercise 4.0 to make the instructions more clear

kappa95 commented 3 years ago

Find the mistake: In the vision_node.cpp everything was with the library: tf instead of tf2_ros. Modifying as in the file you linked everything worked! Thank you so much!