ros / ros_tutorials

Code used in tutorials found on ROS wiki
http://wiki.ros.org/ros_tutorials
805 stars 540 forks source link

a independent package.xml and CMakeList.xml for a single package ? #124

Closed zhangtianren closed 3 years ago

zhangtianren commented 3 years ago

About Python ros package:

i am not puzzled about the coding context , but the package building config has always troubling me all the time .

for example :

recently , i meet a problem ,with building ready OK, but run python ros node reporting errors as below:

import: not authorized `os' @ error/constitute.c/WriteImage/1028.
import: not authorized `rospy' @ error/constitute.c/WriteImage/1028.
import: not authorized `np' @ error/constitute.c/WriteImage/1028.
import: not authorized `tf' @ error/constitute.c/WriteImage/1028.
from: can't read /var/mail/geometry_msgs.msg
from: can't read /var/mail/pose_estimation.srv
from: can't read /var/mail/sensor_msgs.msg
from: can't read /var/mail/cv_bridge
import: not authorized `cv2' @ error/constitute.c/WriteImage/1028.
import: not authorized `requests' @ error/constitute.c/WriteImage/1028.
/root/catkin_ws/src/pose_estimation/src/pose_estimation_server.py: 行 36:
/root/catkin_ws/src/pose_estimation/src/pose_estimation_server.py: 行 36: `bridge = CvBridge()'

i can not get help by reading the demo example CMakeLists , So, could you plz make the examples package building configs independent .

zhangtianren commented 3 years ago

i have fix it by remove the "catkin_python_setup() " and setup.py