Skip to content

Commit

Permalink
Updated dockerfile and applied pre-commit changes
Browse files Browse the repository at this point in the history
  • Loading branch information
rakeshv24 committed Jun 11, 2024
1 parent e08c5a1 commit 9a6c4fa
Show file tree
Hide file tree
Showing 3 changed files with 3 additions and 11 deletions.
1 change: 0 additions & 1 deletion .docker/Dockerfile
Original file line number Diff line number Diff line change
Expand Up @@ -124,7 +124,6 @@ RUN sudo apt-get -q update \

RUN . "/opt/ros/${ROS_DISTRO}/setup.sh" \
&& catkin_make \
&& sudo sed -i "s#/opt/ros/\$ROS_DISTRO/setup.bash#$USER_WORKSPACE/setup.sh#g" /ros_entrypoint.sh \
&& echo "source ${USER_WORKSPACE}/devel/setup.bash" >> /home/$USERNAME/.bashrc \
&& echo "if [ -f /opt/ros/${ROS_DISTRO}/setup.bash ]; then source /opt/ros/${ROS_DISTRO}/setup.bash; fi" >> /home/$USERNAME/.bashrc

Expand Down
6 changes: 0 additions & 6 deletions docking_control/src/docking_control/mpc_casadi.py
Original file line number Diff line number Diff line change
@@ -1,12 +1,6 @@
import yaml
import numpy as np
from casadi import SX, Function, integrator, Opti, evalf, mtimes, vertcat, pinv
import sys

sys.path.insert(
0, "/home/darth/workspace/bluerov2_ws/src/bluerov2_dock/src/bluerov2_dock"
)

from auv_hinsdale import AUV


Expand Down
7 changes: 3 additions & 4 deletions docking_control/src/docking_control/video.py
Original file line number Diff line number Diff line change
@@ -1,15 +1,14 @@
#!/usr/bin/env python3

import gi

gi.require_version("Gst", "1.0")
from gi.repository import Gst

import numpy as np
import rospy
from cv_bridge import CvBridge
from sensor_msgs.msg import Image

gi.require_version("Gst", "1.0")
from gi.repository import Gst # noqa: E402


class Video:
"""BlueRov video capture class constructor
Expand Down

0 comments on commit 9a6c4fa

Please sign in to comment.